00001 #include "image_transport/simple_subscriber_plugin.h"
00002 #include <sensor_msgs/CompressedImage.h>
00003
00004 namespace compressed_image_transport {
00005
00006 class CompressedSubscriber : public image_transport::SimpleSubscriberPlugin<sensor_msgs::CompressedImage>
00007 {
00008 public:
00009 virtual ~CompressedSubscriber() {}
00010
00011 virtual std::string getTransportName() const
00012 {
00013 return "compressed";
00014 }
00015
00016 protected:
00017 virtual void internalCallback(const sensor_msgs::CompressedImageConstPtr& message,
00018 const Callback& user_cb);
00019 };
00020
00021 }