37 #ifndef JSK_PCL_ROS_HEIGHTMAP_TO_POINTCLOUD_H_ 38 #define JSK_PCL_ROS_HEIGHTMAP_TO_POINTCLOUD_H_ 42 #include <dynamic_reconfigure/server.h> 43 #include <sensor_msgs/PointCloud2.h> 44 #include <sensor_msgs/Image.h> 59 virtual void convert(
const sensor_msgs::Image::ConstPtr&
msg);
61 const jsk_recognition_msgs::HeightmapConfig::ConstPtr& msg);
jsk_recognition_msgs::HeightmapConfig::ConstPtr config_msg_
ros::Publisher pub_config_
virtual void convert(const sensor_msgs::Image::ConstPtr &msg)
virtual void unsubscribe()
virtual void configCallback(const jsk_recognition_msgs::HeightmapConfig::ConstPtr &msg)
ros::Subscriber sub_config_
boost::mutex mutex
global mutex.
boost::shared_ptr< HeightmapToPointCloud > Ptr