#include <publisher.h>

Public Member Functions | |
| void | publish (const pcl::PointCloud< PointT > &point_cloud) const |
| void | publish (const boost::shared_ptr< const pcl::PointCloud< PointT > > &point_cloud) const |
| Publisher (ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size) | |
| Publisher () | |
| ~Publisher () | |
Definition at line 90 of file publisher.h.
| pcl_ros::Publisher< PointT >::Publisher | ( | ) | [inline] |
Definition at line 93 of file publisher.h.
| pcl_ros::Publisher< PointT >::Publisher | ( | ros::NodeHandle & | nh, | |
| const std::string & | topic, | |||
| uint32_t | queue_size | |||
| ) | [inline] |
Definition at line 95 of file publisher.h.
| pcl_ros::Publisher< PointT >::~Publisher | ( | ) | [inline] |
Definition at line 100 of file publisher.h.
| void pcl_ros::Publisher< PointT >::publish | ( | const pcl::PointCloud< PointT > & | point_cloud | ) | const [inline] |
Definition at line 109 of file publisher.h.
| void pcl_ros::Publisher< PointT >::publish | ( | const boost::shared_ptr< const pcl::PointCloud< PointT > > & | point_cloud | ) | const [inline] |
Definition at line 103 of file publisher.h.