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


compressed_depth_image_transport
Author(s): Julius Kammerl
autogenerated on Sat Dec 28 2013 17:06:20