$search
Public Member Functions | |
TestTalker () | |
Protected Member Functions | |
virtual void | onInit () |
Nodelet initialization routine. Reads in global parameters used by all nodelets. | |
Protected Attributes | |
sensor_msgs::PointCloud2 | cloud_blob_ |
sensor_msgs::PointCloud2::Ptr | cloud_blob_ptr_ |
ros::Publisher | pub_output_ |
The output PointCloud publisher. |
Definition at line 46 of file test_passing.cpp.
pcl_ros::TestTalker::TestTalker | ( | ) | [inline] |
Definition at line 49 of file test_passing.cpp.
virtual void pcl_ros::TestTalker::onInit | ( | ) | [inline, protected, virtual] |
Nodelet initialization routine. Reads in global parameters used by all nodelets.
Reimplemented from pcl_ros::PCLNodelet.
Definition at line 80 of file test_passing.cpp.
Definition at line 75 of file test_passing.cpp.
Definition at line 76 of file test_passing.cpp.
ros::Publisher pcl_ros::TestTalker::pub_output_ [protected] |
The output PointCloud publisher.
Reimplemented from pcl_ros::PCLNodelet.
Definition at line 77 of file test_passing.cpp.