Open 3D Engine ROS2 Gem API Reference
23.05.0
O3DE is an open-source, fully-featured, high-fidelity, modular 3D engine for building games and simulations, available to every industry.
|
Implementation of camera sensors that runs pipeline which produces depth image. More...
#include <CameraSensor.h>
Inherits ROS2::CameraSensor.
Public Member Functions | |
CameraDepthSensor (const CameraSensorDescription &cameraSensorDescription) | |
![]() | |
CameraSensor (const CameraSensorDescription &cameraSensorDescription) | |
virtual | ~CameraSensor () |
Deinitializes rendering pipeline for the camera sensor. | |
void | RequestMessagePublication (std::shared_ptr< rclcpp::Publisher< sensor_msgs::msg::Image >> publisher, const AZ::Transform &cameraPose, const std_msgs::msg::Header &header) |
const CameraSensorDescription & | GetCameraSensorDescription () const |
Get the camera sensor description. | |
Additional Inherited Members | |
![]() | |
void | SetupPasses () |
Type of returned data eg Color, Depth, Optical flow. More... | |
Implementation of camera sensors that runs pipeline which produces depth image.