00001 #include <message_transport/raw_subscriber.h>
00002 #include <sensor_msgs/PointCloud.h>
00003
00004 namespace decimated_transport {
00005
00006 class DecimatedSubscriber : public message_transport::RawSubscriber<sensor_msgs::PointCloud>
00007 {
00008 public:
00009 virtual ~DecimatedSubscriber() {}
00010
00011 virtual std::string getTransportName() const
00012 {
00013 return "decimated";
00014 }
00015 };
00016
00017 }