#include <heightmap_to_pointcloud.h>
| Public Types | |
| typedef boost::shared_ptr < HeightmapToPointCloud > | Ptr | 
| Public Member Functions | |
| HeightmapToPointCloud () | |
| Protected Member Functions | |
| virtual void | configCallback (const jsk_recognition_msgs::HeightmapConfig::ConstPtr &msg) | 
| virtual void | convert (const sensor_msgs::Image::ConstPtr &msg) | 
| virtual void | onInit () | 
| virtual void | subscribe () | 
| virtual void | unsubscribe () | 
| Protected Attributes | |
| jsk_recognition_msgs::HeightmapConfig::ConstPtr | config_msg_ | 
| double | max_x_ | 
| double | max_y_ | 
| double | min_x_ | 
| double | min_y_ | 
| boost::mutex | mutex_ | 
| ros::Publisher | pub_ | 
| ros::Publisher | pub_config_ | 
| ros::Subscriber | sub_ | 
| ros::Subscriber | sub_config_ | 
Definition at line 49 of file heightmap_to_pointcloud.h.
| typedef boost::shared_ptr<HeightmapToPointCloud> jsk_pcl_ros::HeightmapToPointCloud::Ptr | 
Definition at line 52 of file heightmap_to_pointcloud.h.
Definition at line 53 of file heightmap_to_pointcloud.h.
| void jsk_pcl_ros::HeightmapToPointCloud::configCallback | ( | const jsk_recognition_msgs::HeightmapConfig::ConstPtr & | msg | ) |  [protected, virtual] | 
Definition at line 69 of file heightmap_to_pointcloud_nodelet.cpp.
| void jsk_pcl_ros::HeightmapToPointCloud::convert | ( | const sensor_msgs::Image::ConstPtr & | msg | ) |  [protected, virtual] | 
Definition at line 81 of file heightmap_to_pointcloud_nodelet.cpp.
| void jsk_pcl_ros::HeightmapToPointCloud::onInit | ( | void | ) |  [protected, virtual] | 
Definition at line 47 of file heightmap_to_pointcloud_nodelet.cpp.
| void jsk_pcl_ros::HeightmapToPointCloud::subscribe | ( | ) |  [protected, virtual] | 
Definition at line 59 of file heightmap_to_pointcloud_nodelet.cpp.
| void jsk_pcl_ros::HeightmapToPointCloud::unsubscribe | ( | ) |  [protected, virtual] | 
Definition at line 64 of file heightmap_to_pointcloud_nodelet.cpp.
| jsk_recognition_msgs::HeightmapConfig::ConstPtr jsk_pcl_ros::HeightmapToPointCloud::config_msg_  [protected] | 
Definition at line 62 of file heightmap_to_pointcloud.h.
| double jsk_pcl_ros::HeightmapToPointCloud::max_x_  [protected] | 
Definition at line 69 of file heightmap_to_pointcloud.h.
| double jsk_pcl_ros::HeightmapToPointCloud::max_y_  [protected] | 
Definition at line 71 of file heightmap_to_pointcloud.h.
| double jsk_pcl_ros::HeightmapToPointCloud::min_x_  [protected] | 
Definition at line 68 of file heightmap_to_pointcloud.h.
| double jsk_pcl_ros::HeightmapToPointCloud::min_y_  [protected] | 
Definition at line 70 of file heightmap_to_pointcloud.h.
Definition at line 63 of file heightmap_to_pointcloud.h.
Definition at line 64 of file heightmap_to_pointcloud.h.
Definition at line 65 of file heightmap_to_pointcloud.h.
Definition at line 66 of file heightmap_to_pointcloud.h.
Definition at line 67 of file heightmap_to_pointcloud.h.