#include <pointcloud_to_mask_image.h>
|
typedef PointCloudToMaskImageConfig | Config |
|
Definition at line 83 of file pointcloud_to_mask_image.h.
◆ Config
◆ PointCloudToMaskImage()
jsk_pcl_ros_utils::PointCloudToMaskImage::PointCloudToMaskImage |
( |
| ) |
|
|
inline |
◆ configCallback()
void jsk_pcl_ros_utils::PointCloudToMaskImage::configCallback |
( |
Config & |
config, |
|
|
uint32_t |
level |
|
) |
| |
|
protectedvirtual |
◆ convert() [1/2]
void jsk_pcl_ros_utils::PointCloudToMaskImage::convert |
( |
const sensor_msgs::Image::ConstPtr & |
image_msg | ) |
|
|
protectedvirtual |
◆ convert() [2/2]
void jsk_pcl_ros_utils::PointCloudToMaskImage::convert |
( |
const sensor_msgs::PointCloud2::ConstPtr & |
cloud_msg | ) |
|
|
protectedvirtual |
◆ onInit()
void jsk_pcl_ros_utils::PointCloudToMaskImage::onInit |
( |
| ) |
|
|
protectedvirtual |
◆ subscribe()
void jsk_pcl_ros_utils::PointCloudToMaskImage::subscribe |
( |
| ) |
|
|
protectedvirtual |
◆ unsubscribe()
void jsk_pcl_ros_utils::PointCloudToMaskImage::unsubscribe |
( |
| ) |
|
|
protectedvirtual |
◆ mutex_
boost::mutex jsk_pcl_ros_utils::PointCloudToMaskImage::mutex_ |
|
protected |
◆ pub_
◆ srv_
◆ sub_cloud_
◆ sub_image_
◆ z_far_
float jsk_pcl_ros_utils::PointCloudToMaskImage::z_far_ |
|
protected |
◆ z_near_
float jsk_pcl_ros_utils::PointCloudToMaskImage::z_near_ |
|
protected |
The documentation for this class was generated from the following files: