Public Member Functions | |
| void | cloud_cb (const sensor_msgs::PointCloud2ConstPtr &cloud) |
| TransformPointCloud () | |
Public Attributes | |
| string | cloud_topic_pub_ |
| string | cloud_topic_sub_ |
| ros::Publisher | pub_ |
| ros::Subscriber | sub_ |
| string | target_frame_ |
| tf::TransformListener | tf_listener_ |
Protected Attributes | |
| ros::NodeHandle | nh_ |
Definition at line 74 of file transform_pointcloud.cpp.
| TransformPointCloud::TransformPointCloud | ( | ) | [inline] |
Definition at line 88 of file transform_pointcloud.cpp.
| void TransformPointCloud::cloud_cb | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud | ) | [inline] |
Definition at line 102 of file transform_pointcloud.cpp.
Definition at line 81 of file transform_pointcloud.cpp.
Definition at line 80 of file transform_pointcloud.cpp.
ros::NodeHandle TransformPointCloud::nh_ [protected] |
Definition at line 77 of file transform_pointcloud.cpp.
Definition at line 86 of file transform_pointcloud.cpp.
Definition at line 85 of file transform_pointcloud.cpp.
Definition at line 82 of file transform_pointcloud.cpp.
Definition at line 84 of file transform_pointcloud.cpp.