Class MujocoCameras
Defined in File mujoco_cameras.hpp
Class Documentation
-
class MujocoCameras
Wraps Mujoco cameras for publishing ROS 2 RGB-D streams.
Public Functions
Constructs a new MujocoCameras wrapper object.
- Parameters:
node – Will be used to construct image publishers
sim_mutex – Provides synchronized access to the mujoco_data object for rendering
mujoco_data – Mujoco data for the simulation
mujoco_model – Mujoco model for the simulation
camera_publish_rate – The rate to publish all camera images, for now all images are published at the same rate.
-
void init()
Starts the image processing thread in the background.
The background thread will initialize its own offscreen glfw context for rendering images that is separate from the Simulate applications, as the context must be in the running thread.
-
void close()
Stops the camera processing thread and closes the relevant objects, call before shutdown.
-
void register_cameras(const hardware_interface::HardwareInfo &hardware_info)
Parses camera information from the mujoco model.