Public Member Functions | |
| void | cloud_cb_points (const sensor_msgs::PointCloudConstPtr &cloud) | 
| PointCloud (old format) callback.   | |
| void | og_params_cb (const point_cloud_ros::OccupancyGrid &og_param) | 
| PointCloudToOccupancyGrid () | |
Private Attributes | |
| geometry_msgs::Point32 | center_ | 
| ros::NodeHandle | nh_ | 
| int | occupancy_threshold_ | 
| string | og_frame_id_ | 
| string | og_out_ | 
| string | og_params_ | 
| string | points_in_ | 
| ros::Publisher | pub_og_ | 
| int | queue_size_ | 
| geometry_msgs::Point32 | resolution_ | 
| geometry_msgs::Point32 | size_ | 
| ros::Subscriber | sub_og_params_ | 
| ros::Subscriber | sub_points_ | 
| tf::TransformListener | tf_listener | 
Definition at line 11 of file pc_to_og.cpp.
| PointCloudToOccupancyGrid::PointCloudToOccupancyGrid | ( | ) |  [inline] | 
        
Definition at line 34 of file pc_to_og.cpp.
| void PointCloudToOccupancyGrid::cloud_cb_points | ( | const sensor_msgs::PointCloudConstPtr & | cloud | ) |  [inline] | 
        
PointCloud (old format) callback.
Definition at line 54 of file pc_to_og.cpp.
| void PointCloudToOccupancyGrid::og_params_cb | ( | const point_cloud_ros::OccupancyGrid & | og_param | ) |  [inline] | 
        
Definition at line 113 of file pc_to_og.cpp.
geometry_msgs::Point32 PointCloudToOccupancyGrid::center_ [private] | 
        
Definition at line 24 of file pc_to_og.cpp.
Definition at line 15 of file pc_to_og.cpp.
int PointCloudToOccupancyGrid::occupancy_threshold_ [private] | 
        
Definition at line 27 of file pc_to_og.cpp.
string PointCloudToOccupancyGrid::og_frame_id_ [private] | 
        
Definition at line 28 of file pc_to_og.cpp.
string PointCloudToOccupancyGrid::og_out_ [private] | 
        
Definition at line 21 of file pc_to_og.cpp.
string PointCloudToOccupancyGrid::og_params_ [private] | 
        
Definition at line 23 of file pc_to_og.cpp.
string PointCloudToOccupancyGrid::points_in_ [private] | 
        
Definition at line 21 of file pc_to_og.cpp.
Definition at line 18 of file pc_to_og.cpp.
int PointCloudToOccupancyGrid::queue_size_ [private] | 
        
Definition at line 20 of file pc_to_og.cpp.
geometry_msgs::Point32 PointCloudToOccupancyGrid::resolution_ [private] | 
        
Definition at line 25 of file pc_to_og.cpp.
geometry_msgs::Point32 PointCloudToOccupancyGrid::size_ [private] | 
        
Definition at line 26 of file pc_to_og.cpp.
Definition at line 17 of file pc_to_og.cpp.
Definition at line 16 of file pc_to_og.cpp.
Definition at line 30 of file pc_to_og.cpp.