Class BasePublisher
Defined in File publisher.hpp
Inheritance Relationships
Derived Types
public pcl_ros::Publisher< PointT >
(Template Class Publisher)public pcl_ros::Publisher< sensor_msgs::PointCloud2 >
(Template Class Publisher< sensor_msgs::PointCloud2 >)
Class Documentation
-
class BasePublisher
Subclassed by pcl_ros::Publisher< PointT >, pcl_ros::Publisher< sensor_msgs::PointCloud2 >
Public Functions
-
inline void advertise(ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size)
-
inline std::string getTopic()
-
inline uint32_t getNumSubscribers() const
-
inline void shutdown()
-
inline operator void*() const
Protected Attributes
-
ros::Publisher pub_
-
inline void advertise(ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size)