37 #ifndef JSK_PCL_ROS_UTILS_POINTCLOUD_TO_MASK_IMAGE_H_
38 #define JSK_PCL_ROS_UTILS_POINTCLOUD_TO_MASK_IMAGE_H_
40 #include <boost/shared_ptr.hpp>
42 #include <dynamic_reconfigure/server.h>
43 #include <jsk_topic_tools/diagnostic_nodelet.h>
44 #include <sensor_msgs/Image.h>
45 #include <sensor_msgs/PointCloud2.h>
47 #include <jsk_pcl_ros_utils/PointCloudToMaskImageConfig.h>
51 class PointCloudToMaskImage:
public jsk_topic_tools::DiagnosticNodelet
54 typedef PointCloudToMaskImageConfig
Config;
64 virtual void convert(
const sensor_msgs::Image::ConstPtr& image_msg);
65 virtual void convert(
const sensor_msgs::PointCloud2::ConstPtr& cloud_msg);
81 #endif // JSK_PCL_ROS_UTILS_POINTCLOUD_TO_MASK_IMAGE_H_