#include <gazebo_ros_depth_camera.h>
|
virtual void | OnNewDepthFrame (const float *_image, unsigned int _width, unsigned int _height, unsigned int _depth, const std::string &_format) override |
| Update the controller. More...
|
|
virtual void | OnNewImageFrame (const unsigned char *_image, unsigned int _width, unsigned int _height, unsigned int _depth, const std::string &_format) override |
| Update the controller. More...
|
|
virtual void | OnNewRGBPointCloud (const float *_pcd, unsigned int _width, unsigned int _height, unsigned int _depth, const std::string &_format) override |
| Update the controller. More...
|
|
virtual void | PublishCameraInfo () |
|
|
void | DepthImageConnect () |
|
void | DepthImageDisconnect () |
|
void | DepthInfoConnect () |
|
void | DepthInfoDisconnect () |
|
void | FillDepthImage (const float *_src) |
| push depth image data into ros topic More...
|
|
bool | FillDepthImageHelper (sensor_msgs::Image &image_msg, uint32_t rows_arg, uint32_t cols_arg, uint32_t step_arg, void *data_arg) |
|
bool | FillPointCloudHelper (sensor_msgs::PointCloud2 &point_cloud_msg, uint32_t rows_arg, uint32_t cols_arg, uint32_t step_arg, void *data_arg) |
|
void | FillPointdCloud (const float *_src) |
| Put camera data to the ROS topic. More...
|
|
void | InfoConnect () |
|
void | InfoDisconnect () |
|
void | NormalsConnect () |
| Increase the counter which count the subscribers are connected. More...
|
|
void | NormalsDisconnect () |
| Decrease the counter which count the subscribers are connected. More...
|
|
void | PointCloudConnect () |
|
void | PointCloudDisconnect () |
|
void | PublishCameraInfo () |
|
void | PublishCameraInfo (common::Time &last_update_time) |
|
void | PublishCameraInfo (ros::Publisher camera_info_publisher) |
| Publish CameraInfo to the ROS topic. More...
|
|
void | ReflectanceConnect () |
| Increase the counter which count the subscribers are connected. More...
|
|
void | ReflectanceDisconnect () |
| Decrease the counter which count the subscribers are connected. More...
|
|
| GazeboRosCameraUtils () |
| Constructor. More...
|
|
void | Load (sensors::SensorPtr _parent, sdf::ElementPtr _sdf, const std::string &_camera_name_suffix, double _hack_baseline) |
| Load the plugin. More...
|
|
void | Load (sensors::SensorPtr _parent, sdf::ElementPtr _sdf, const std::string &_camera_name_suffix="") |
| Load the plugin. More...
|
|
event::ConnectionPtr | OnLoad (const boost::function< void()> &) |
|
| ~GazeboRosCameraUtils () |
| Destructor. More...
|
|
void | CameraQueueThread () |
|
virtual bool | CanTriggerCamera () |
|
void | ImageConnect () |
|
void | ImageDisconnect () |
|
void | PublishCameraInfo () |
|
void | PublishCameraInfo (common::Time &last_update_time) |
|
void | PublishCameraInfo (ros::Publisher camera_info_publisher) |
| Publish CameraInfo to the ROS topic. More...
|
|
void | PutCameraData (const unsigned char *_src) |
| Put camera data to the ROS topic. More...
|
|
void | PutCameraData (const unsigned char *_src, common::Time &last_update_time) |
|
virtual void | TriggerCamera () |
|
Definition at line 62 of file gazebo_ros_depth_camera.h.
◆ GazeboRosDepthCamera()
gazebo::GazeboRosDepthCamera::GazeboRosDepthCamera |
( |
| ) |
|
◆ ~GazeboRosDepthCamera()
gazebo::GazeboRosDepthCamera::~GazeboRosDepthCamera |
( |
| ) |
|
◆ Advertise()
void gazebo::GazeboRosDepthCamera::Advertise |
( |
| ) |
|
|
virtual |
◆ DepthImageConnect()
void gazebo::GazeboRosDepthCamera::DepthImageConnect |
( |
| ) |
|
|
private |
◆ DepthImageDisconnect()
void gazebo::GazeboRosDepthCamera::DepthImageDisconnect |
( |
| ) |
|
|
private |
◆ DepthInfoConnect()
void gazebo::GazeboRosDepthCamera::DepthInfoConnect |
( |
| ) |
|
|
private |
◆ DepthInfoDisconnect()
void gazebo::GazeboRosDepthCamera::DepthInfoDisconnect |
( |
| ) |
|
|
private |
◆ FillDepthImage()
void gazebo::GazeboRosDepthCamera::FillDepthImage |
( |
const float * |
_src | ) |
|
|
private |
◆ FillDepthImageHelper()
bool gazebo::GazeboRosDepthCamera::FillDepthImageHelper |
( |
sensor_msgs::Image & |
image_msg, |
|
|
uint32_t |
rows_arg, |
|
|
uint32_t |
cols_arg, |
|
|
uint32_t |
step_arg, |
|
|
void * |
data_arg |
|
) |
| |
|
private |
◆ FillPointCloudHelper()
bool gazebo::GazeboRosDepthCamera::FillPointCloudHelper |
( |
sensor_msgs::PointCloud2 & |
point_cloud_msg, |
|
|
uint32_t |
rows_arg, |
|
|
uint32_t |
cols_arg, |
|
|
uint32_t |
step_arg, |
|
|
void * |
data_arg |
|
) |
| |
|
private |
◆ FillPointdCloud()
void gazebo::GazeboRosDepthCamera::FillPointdCloud |
( |
const float * |
_src | ) |
|
|
private |
◆ InfoConnect()
void gazebo::GazeboRosDepthCamera::InfoConnect |
( |
| ) |
|
|
private |
◆ InfoDisconnect()
void gazebo::GazeboRosDepthCamera::InfoDisconnect |
( |
| ) |
|
|
private |
◆ Load()
void gazebo::GazeboRosDepthCamera::Load |
( |
sensors::SensorPtr |
_parent, |
|
|
sdf::ElementPtr |
_sdf |
|
) |
| |
|
overridevirtual |
◆ NormalsConnect()
void gazebo::GazeboRosDepthCamera::NormalsConnect |
( |
| ) |
|
|
private |
◆ NormalsDisconnect()
void gazebo::GazeboRosDepthCamera::NormalsDisconnect |
( |
| ) |
|
|
private |
◆ OnNewDepthFrame()
void gazebo::GazeboRosDepthCamera::OnNewDepthFrame |
( |
const float * |
_image, |
|
|
unsigned int |
_width, |
|
|
unsigned int |
_height, |
|
|
unsigned int |
_depth, |
|
|
const std::string & |
_format |
|
) |
| |
|
overrideprotectedvirtual |
◆ OnNewImageFrame()
void gazebo::GazeboRosDepthCamera::OnNewImageFrame |
( |
const unsigned char * |
_image, |
|
|
unsigned int |
_width, |
|
|
unsigned int |
_height, |
|
|
unsigned int |
_depth, |
|
|
const std::string & |
_format |
|
) |
| |
|
overrideprotectedvirtual |
◆ OnNewRGBPointCloud()
void gazebo::GazeboRosDepthCamera::OnNewRGBPointCloud |
( |
const float * |
_pcd, |
|
|
unsigned int |
_width, |
|
|
unsigned int |
_height, |
|
|
unsigned int |
_depth, |
|
|
const std::string & |
_format |
|
) |
| |
|
overrideprotectedvirtual |
◆ PointCloudConnect()
void gazebo::GazeboRosDepthCamera::PointCloudConnect |
( |
| ) |
|
|
private |
◆ PointCloudDisconnect()
void gazebo::GazeboRosDepthCamera::PointCloudDisconnect |
( |
| ) |
|
|
private |
◆ PublishCameraInfo() [1/4]
void gazebo::GazeboRosCameraUtils::PublishCameraInfo |
|
private |
◆ PublishCameraInfo() [2/4]
void gazebo::GazeboRosDepthCamera::PublishCameraInfo |
( |
| ) |
|
|
protectedvirtual |
◆ PublishCameraInfo() [3/4]
void gazebo::GazeboRosCameraUtils::PublishCameraInfo |
|
private |
◆ PublishCameraInfo() [4/4]
void gazebo::GazeboRosCameraUtils::PublishCameraInfo |
|
private |
◆ ReflectanceConnect()
void gazebo::GazeboRosDepthCamera::ReflectanceConnect |
( |
| ) |
|
|
private |
◆ ReflectanceDisconnect()
void gazebo::GazeboRosDepthCamera::ReflectanceDisconnect |
( |
| ) |
|
|
private |
◆ depth_image_camera_info_pub_
ros::Publisher gazebo::GazeboRosDepthCamera::depth_image_camera_info_pub_ |
|
protected |
◆ depth_image_camera_info_topic_name_
std::string gazebo::GazeboRosDepthCamera::depth_image_camera_info_topic_name_ |
|
private |
◆ depth_image_connect_count_
int gazebo::GazeboRosDepthCamera::depth_image_connect_count_ |
|
private |
◆ depth_image_msg_
sensor_msgs::Image gazebo::GazeboRosDepthCamera::depth_image_msg_ |
|
private |
◆ depth_image_pub_
◆ depth_image_topic_name_
std::string gazebo::GazeboRosDepthCamera::depth_image_topic_name_ |
|
private |
◆ depth_info_connect_count_
int gazebo::GazeboRosDepthCamera::depth_info_connect_count_ |
|
private |
◆ depth_sensor_update_time_
common::Time gazebo::GazeboRosDepthCamera::depth_sensor_update_time_ |
|
private |
◆ last_depth_image_camera_info_update_time_
common::Time gazebo::GazeboRosDepthCamera::last_depth_image_camera_info_update_time_ |
|
private |
◆ load_connection_
◆ normal_pub_
◆ normals_connect_count_
int gazebo::GazeboRosDepthCamera::normals_connect_count_ |
|
private |
◆ normals_topic_name_
std::string gazebo::GazeboRosDepthCamera::normals_topic_name_ |
|
private |
◆ pcd_
float* gazebo::GazeboRosDepthCamera::pcd_ = nullptr |
|
private |
◆ point_cloud_connect_count_
int gazebo::GazeboRosDepthCamera::point_cloud_connect_count_ |
|
private |
◆ point_cloud_cutoff_
double gazebo::GazeboRosDepthCamera::point_cloud_cutoff_ |
|
private |
◆ point_cloud_msg_
sensor_msgs::PointCloud2 gazebo::GazeboRosDepthCamera::point_cloud_msg_ |
|
private |
◆ point_cloud_pub_
◆ point_cloud_topic_name_
std::string gazebo::GazeboRosDepthCamera::point_cloud_topic_name_ |
|
private |
◆ reduce_normals_
int gazebo::GazeboRosDepthCamera::reduce_normals_ |
|
private |
◆ reflectance_connect_count_
int gazebo::GazeboRosDepthCamera::reflectance_connect_count_ |
|
private |
◆ reflectance_msg_
sensor_msgs::Image gazebo::GazeboRosDepthCamera::reflectance_msg_ |
|
private |
◆ reflectance_pub_
◆ reflectance_topic_name_
std::string gazebo::GazeboRosDepthCamera::reflectance_topic_name_ |
|
private |
◆ use_depth_image_16UC1_format_
bool gazebo::GazeboRosDepthCamera::use_depth_image_16UC1_format_ |
|
private |
The documentation for this class was generated from the following files: