37 #ifndef JSK_PCL_ROS_HEIGHTMAP_TO_POINTCLOUD_H_ 
   38 #define JSK_PCL_ROS_HEIGHTMAP_TO_POINTCLOUD_H_ 
   41 #include <jsk_topic_tools/diagnostic_nodelet.h> 
   42 #include <dynamic_reconfigure/server.h> 
   43 #include <sensor_msgs/PointCloud2.h> 
   44 #include <sensor_msgs/Image.h> 
   49   class HeightmapToPointCloud: 
public jsk_topic_tools::DiagnosticNodelet
 
   59     virtual void convert(
const sensor_msgs::Image::ConstPtr& 
msg);
 
   61       const jsk_recognition_msgs::HeightmapConfig::ConstPtr& 
msg);
 
   62     jsk_recognition_msgs::HeightmapConfig::ConstPtr 
config_msg_;