Open 3D Engine ROS2 Gem API Reference
24.09
O3DE is an open-source, fully-featured, high-fidelity, modular 3D engine for building games and simulations, available to every industry.
|
#include <CameraPublishers.h>
Public Types | |
using | ImagePublisherPtrType = std::shared_ptr< rclcpp::Publisher< sensor_msgs::msg::Image > > |
ROS2 image publisher type. | |
using | CameraInfoPublisherPtrType = std::shared_ptr< rclcpp::Publisher< sensor_msgs::msg::CameraInfo > > |
ROS2 camera sensor publisher type. | |
Public Member Functions | |
CameraPublishers (const CameraSensorDescription &cameraDescription) | |
ImagePublisherPtrType | GetImagePublisher (CameraSensorDescription::CameraChannelType type) |
CameraInfoPublisherPtrType | GetInfoPublisher (CameraSensorDescription::CameraChannelType type) |
Handles all the ROS publishing related to a single camera. This includes 1-2 CameraInfo topics as well as 1-2 Image topics.