Public Member Functions | |
| LaserscanToPointcloud () | |
| void | scanCallback (const sensor_msgs::LaserScan::ConstPtr &scan_in) |
Protected Attributes | |
| ros::Publisher | point_cloud2_pub_ |
| laser_geometry::LaserProjection | projector_ |
| ros::Subscriber | scan_sub_ |
Definition at line 32 of file laserscan_to_pointcloud_node.cpp.
| LaserscanToPointcloud::LaserscanToPointcloud | ( | ) | [inline] |
Definition at line 36 of file laserscan_to_pointcloud_node.cpp.
| void LaserscanToPointcloud::scanCallback | ( | const sensor_msgs::LaserScan::ConstPtr & | scan_in | ) | [inline] |
Definition at line 44 of file laserscan_to_pointcloud_node.cpp.
Definition at line 53 of file laserscan_to_pointcloud_node.cpp.
Definition at line 55 of file laserscan_to_pointcloud_node.cpp.
ros::Subscriber LaserscanToPointcloud::scan_sub_ [protected] |
Definition at line 52 of file laserscan_to_pointcloud_node.cpp.