#include <publisher.h>
Public Member Functions | |
void | publish (const sensor_msgs::PointCloud2Ptr &point_cloud) const |
void | publish (const sensor_msgs::PointCloud2 &point_cloud) const |
Publisher () | |
Publisher (ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size) | |
~Publisher () | |
Public Member Functions inherited from pcl_ros::BasePublisher | |
void | advertise (ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size) |
uint32_t | getNumSubscribers () const |
std::string | getTopic () |
operator void * () const | |
void | shutdown () |
Additional Inherited Members | |
Protected Attributes inherited from pcl_ros::BasePublisher | |
ros::Publisher | pub_ |
Definition at line 122 of file publisher.h.
|
inline |
Definition at line 125 of file publisher.h.
|
inline |
Definition at line 127 of file publisher.h.
|
inline |
Definition at line 132 of file publisher.h.
|
inline |
Definition at line 135 of file publisher.h.
|
inline |
Definition at line 142 of file publisher.h.