Class SingleSubscriberPublisher

Class Documentation

class SingleSubscriberPublisher

Allows publication of an image to a single subscriber. Only available inside subscriber connection callbacks.

Public Types

typedef std::function<size_t()> GetNumSubscribersFn
typedef std::function<void(const sensor_msgs::msg::Image&)> PublishFn

Public Functions

IMAGE_TRANSPORT_PUBLIC SingleSubscriberPublisher(const std::string &caller_id, const std::string &topic, const GetNumSubscribersFn &num_subscribers_fn, const PublishFn &publish_fn)
IMAGE_TRANSPORT_PUBLIC std::string getSubscriberName () const
IMAGE_TRANSPORT_PUBLIC std::string getTopic () const
IMAGE_TRANSPORT_PUBLIC size_t getNumSubscribers () const
IMAGE_TRANSPORT_PUBLIC void publish (const sensor_msgs::msg::Image &message) const
IMAGE_TRANSPORT_PUBLIC void publish (const sensor_msgs::msg::Image::ConstSharedPtr &message) const