35 #ifndef IMAGE_TRANSPORT_SUBSCRIBER_H 36 #define IMAGE_TRANSPORT_SUBSCRIBER_H 39 #include <sensor_msgs/Image.h> 73 std::string getTopic()
const;
78 uint32_t getNumPublishers()
const;
83 std::string getTransport()
const;
90 operator void*()
const;
97 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...
boost::shared_ptr< Impl > ImplPtr
bool operator!=(const Subscriber &rhs) const
#define IMAGE_TRANSPORT_DECL
Stores transport settings for an image topic subscription.
Advertise and subscribe to image topics.