Public Member Functions | |
| PclSnapshot () | |
| bool | take_snapshot (pointcloud_snapshot_service::PointCloudSnapShot::Request &req, pointcloud_snapshot_service::PointCloudSnapShot::Response &res) | 
Public Attributes | |
| pcl::VoxelGrid < sensor_msgs::PointCloud2 >  | filter | 
| ros::NodeHandle | nh_ | 
| ros::Publisher | snapshot_pub | 
| ros::ServiceServer | snapshot_server | 
| tf::TransformListener | tf_listener_ | 
Definition at line 11 of file pointcloud_snapshot.cpp.
| PclSnapshot::PclSnapshot | ( | ) |  [inline] | 
        
Definition at line 20 of file pointcloud_snapshot.cpp.
| bool PclSnapshot::take_snapshot | ( | pointcloud_snapshot_service::PointCloudSnapShot::Request & | req, | 
| pointcloud_snapshot_service::PointCloudSnapShot::Response & | res | ||
| ) |  [inline] | 
        
Definition at line 32 of file pointcloud_snapshot.cpp.
| pcl::VoxelGrid<sensor_msgs::PointCloud2> PclSnapshot::filter | 
Definition at line 17 of file pointcloud_snapshot.cpp.
Definition at line 13 of file pointcloud_snapshot.cpp.
Definition at line 15 of file pointcloud_snapshot.cpp.
Definition at line 16 of file pointcloud_snapshot.cpp.
Definition at line 18 of file pointcloud_snapshot.cpp.