Struct CameraData
Defined in File mujoco_cameras.hpp
Struct Documentation
-
struct CameraData
Public Members
-
mjvCamera mjv_cam
-
mjrRect viewport
-
std::string name
-
std::string frame_name
-
std::string info_topic
-
std::string image_topic
-
std::string depth_topic
-
uint32_t width
-
uint32_t height
-
std::vector<uint8_t> image_buffer
-
std::vector<float> depth_buffer
-
std::vector<float> depth_buffer_flipped
-
sensor_msgs::msg::Image image
-
sensor_msgs::msg::Image depth_image
-
sensor_msgs::msg::CameraInfo camera_info
-
rclcpp::Publisher<sensor_msgs::msg::Image>::SharedPtr image_pub
-
rclcpp::Publisher<sensor_msgs::msg::Image>::SharedPtr depth_image_pub
-
rclcpp::Publisher<sensor_msgs::msg::CameraInfo>::SharedPtr camera_info_pub
-
mjvCamera mjv_cam