Public Member Functions | |
void | cbPoints (const sensor_msgs::PointCloud2::Ptr &msg) |
PointcloudToMapsNode () | |
Private Attributes | |
ros::NodeHandle | nh_ |
ros::NodeHandle | pnh_ |
ros::Publisher | pub_map_array_ |
std::map< std::string, ros::Publisher > | pub_maps_ |
ros::Subscriber | sub_points_ |
Definition at line 88 of file pointcloud_to_maps.cpp.
PointcloudToMapsNode::PointcloudToMapsNode | ( | ) | [inline] |
Definition at line 98 of file pointcloud_to_maps.cpp.
void PointcloudToMapsNode::cbPoints | ( | const sensor_msgs::PointCloud2::Ptr & | msg | ) | [inline] |
Definition at line 108 of file pointcloud_to_maps.cpp.
ros::NodeHandle PointcloudToMapsNode::nh_ [private] |
Definition at line 92 of file pointcloud_to_maps.cpp.
ros::NodeHandle PointcloudToMapsNode::pnh_ [private] |
Definition at line 91 of file pointcloud_to_maps.cpp.
Definition at line 94 of file pointcloud_to_maps.cpp.
std::map<std::string, ros::Publisher> PointcloudToMapsNode::pub_maps_ [private] |
Definition at line 93 of file pointcloud_to_maps.cpp.
Definition at line 95 of file pointcloud_to_maps.cpp.