Go to the documentation of this file.
45 #include <boost/shared_ptr.hpp>
46 #include <boost/weak_ptr.hpp>
50 #include <sensor_msgs/PointCloud2.h>
71 void publish(
const sensor_msgs::PointCloud2& message)
const;
74 void publish(
const sensor_msgs::PointCloud2ConstPtr& message)
const;
79 operator void*()
const;
std::string getTopic() const
get base topic of this Publisher
boost::function< void(const SingleSubscriberPublisher &)> SubscriberStatusCallback
void shutdown()
Shutdown the advertisements associated with this Publisher.
boost::shared_ptr< Impl > ImplPtr
bool operator<(const point_cloud_transport::Publisher &rhs) const
boost::weak_ptr< Impl > ImplWPtr
static void weakSubscriberCb(const ImplWPtr &impl_wptr, const point_cloud_transport::SingleSubscriberPublisher &plugin_pub, const point_cloud_transport::SubscriberStatusCallback &user_cb)
point_cloud_transport::SubscriberStatusCallback rebindCB(const point_cloud_transport::SubscriberStatusCallback &user_cb)
Allows publication of a point cloud to a single subscriber. Only available inside subscriber connecti...
void publish(const sensor_msgs::PointCloud2 &message) const
Publish a point cloud on the topics associated with this Publisher.
bool operator!=(const point_cloud_transport::Publisher &rhs) const
bool operator==(const point_cloud_transport::Publisher &rhs) const
uint32_t getNumSubscribers() const
get total number of subscribers to all advertised topics.