|
void | connectCb () |
|
template<typename T > |
void | convert (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &rgb_msg, const PointCloud::Ptr &cloud_msg, int red_offset, int green_offset, int blue_offset, int color_step) |
|
void | imageCb (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &rgb_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) |
|
virtual void | onInit () |
|
Definition at line 92 of file point_cloud_xyzrgb.cpp.
◆ ExactSynchronizer
◆ ExactSyncPolicy
◆ PointCloud
◆ Synchronizer
◆ SyncPolicy
◆ connectCb()
void depth_image_proc::PointCloudXyzrgbNodelet::connectCb |
( |
| ) |
|
|
private |
◆ convert()
template<typename T >
void depth_image_proc::PointCloudXyzrgbNodelet::convert |
( |
const sensor_msgs::ImageConstPtr & |
depth_msg, |
|
|
const sensor_msgs::ImageConstPtr & |
rgb_msg, |
|
|
const PointCloud::Ptr & |
cloud_msg, |
|
|
int |
red_offset, |
|
|
int |
green_offset, |
|
|
int |
blue_offset, |
|
|
int |
color_step |
|
) |
| |
|
private |
◆ imageCb()
void depth_image_proc::PointCloudXyzrgbNodelet::imageCb |
( |
const sensor_msgs::ImageConstPtr & |
depth_msg, |
|
|
const sensor_msgs::ImageConstPtr & |
rgb_msg, |
|
|
const sensor_msgs::CameraInfoConstPtr & |
info_msg |
|
) |
| |
|
private |
◆ onInit()
void depth_image_proc::PointCloudXyzrgbNodelet::onInit |
( |
| ) |
|
|
privatevirtual |
◆ connect_mutex_
boost::mutex depth_image_proc::PointCloudXyzrgbNodelet::connect_mutex_ |
|
private |
◆ depth_it_
◆ exact_sync_
◆ model_
◆ pub_point_cloud_
ros::Publisher depth_image_proc::PointCloudXyzrgbNodelet::pub_point_cloud_ |
|
private |
◆ rgb_it_
◆ rgb_nh_
◆ sub_depth_
◆ sub_info_
◆ sub_rgb_
◆ sync_
The documentation for this class was generated from the following file: