#include <imagezero_subscriber.h>
Public Member Functions | |
virtual std::string | getTransportName () const |
ImageZeroSubscriber () | |
virtual | ~ImageZeroSubscriber () |
Protected Member Functions | |
virtual void | internalCallback (const sensor_msgs::CompressedImageConstPtr &message, const Callback &user_cb) |
virtual void | subscribeImpl (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, const Callback &callback, const ros::VoidPtr &tracked_object, const image_transport::TransportHints &transport_hints) |
ROS image_transport subscriber plugin that will convert sensor_msgs::CompressedImage message to sensor_msgs::Image messages.
Definition at line 39 of file imagezero_subscriber.h.
Definition at line 35 of file imagezero_subscriber.cpp.
virtual imagezero_image_transport::ImageZeroSubscriber::~ImageZeroSubscriber | ( | ) | [inline, virtual] |
Definition at line 44 of file imagezero_subscriber.h.
virtual std::string imagezero_image_transport::ImageZeroSubscriber::getTransportName | ( | ) | const [inline, virtual] |
Implements image_transport::SubscriberPlugin.
Definition at line 47 of file imagezero_subscriber.h.
void imagezero_image_transport::ImageZeroSubscriber::internalCallback | ( | const sensor_msgs::CompressedImageConstPtr & | message, |
const Callback & | user_cb | ||
) | [protected, virtual] |
Definition at line 48 of file imagezero_subscriber.cpp.
void imagezero_image_transport::ImageZeroSubscriber::subscribeImpl | ( | ros::NodeHandle & | nh, |
const std::string & | base_topic, | ||
uint32_t | queue_size, | ||
const Callback & | callback, | ||
const ros::VoidPtr & | tracked_object, | ||
const image_transport::TransportHints & | transport_hints | ||
) | [protected, virtual] |
Reimplemented from image_transport::SimpleSubscriberPlugin< sensor_msgs::CompressedImage >.
Definition at line 40 of file imagezero_subscriber.cpp.