|
virtual std::string | getTransportName () const |
| Get a string identifier for the transport provided by this plugin. More...
|
|
virtual | ~ResizedSubscriber () |
|
virtual uint32_t | getNumPublishers () const |
| Returns the number of publishers this subscriber is connected to. More...
|
|
virtual std::string | getTopic () const |
| Get the transport-specific communication topic. More...
|
|
virtual void | shutdown () |
| Unsubscribe the callback associated with this SubscriberPlugin. More...
|
|
virtual | ~SimpleSubscriberPlugin () |
|
virtual uint32_t | getNumPublishers () const =0 |
| Returns the number of publishers this subscriber is connected to. More...
|
|
virtual std::string | getTopic () const =0 |
| Get the transport-specific communication topic. More...
|
|
void | subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, const Callback &callback, const ros::VoidPtr &tracked_object=ros::VoidPtr(), const TransportHints &transport_hints=TransportHints()) |
| Subscribe to an image topic, version for arbitrary boost::function object. More...
|
|
void | subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, void(*fp)(const sensor_msgs::ImageConstPtr &), const TransportHints &transport_hints=TransportHints()) |
| Subscribe to an image topic, version for bare function. More...
|
|
template<class T > |
void | subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, void(T::*fp)(const sensor_msgs::ImageConstPtr &), const boost::shared_ptr< T > &obj, const TransportHints &transport_hints=TransportHints()) |
| Subscribe to an image topic, version for class member function with shared_ptr. More...
|
|
template<class T > |
void | subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, void(T::*fp)(const sensor_msgs::ImageConstPtr &), T *obj, const TransportHints &transport_hints=TransportHints()) |
| Subscribe to an image topic, version for class member function with bare pointer. More...
|
|
virtual | ~SubscriberPlugin () |
|