35 #ifndef IMAGE_TRANSPORT_SUBSCRIBER_H 36 #define IMAGE_TRANSPORT_SUBSCRIBER_H 39 #include <sensor_msgs/Image.h> 89 operator void*()
const;
96 const boost::function<
void(
const sensor_msgs::ImageConstPtr&)>& callback,
bool operator==(const Subscriber &rhs) const
boost::weak_ptr< Impl > ImplWPtr
Manages a subscription callback on a specific topic that can be interpreted as an Image topic...
bool operator<(const Subscriber &rhs) const
std::string getTransport() const
Returns the name of the transport being used.
std::string getTopic() const
Returns the base image topic.
boost::shared_ptr< Impl > ImplPtr
uint32_t getNumPublishers() const
Returns the number of publishers this subscriber is connected to.
bool operator!=(const Subscriber &rhs) const
void shutdown()
Unsubscribe the callback associated with this Subscriber.
Stores transport settings for an image topic subscription.
Advertise and subscribe to image topics.