Go to the documentation of this file.00001
00006 #ifndef PUBLISHER_H
00007 #define PUBLISHER_H
00008
00009 #include <ros/ros.h>
00010 #include <sensor_msgs/Image.h>
00011 #include <cv_bridge/cv_bridge.h>
00012
00013 #include <opencv2/opencv.hpp>
00014
00015 #include "tracking.h"
00016 #include "frame.h"
00017
00018 using namespace std;
00019
00020 namespace slam
00021 {
00022
00023 class Tracking;
00024
00025 class Publisher
00026 {
00027
00028 public:
00029
00032 Publisher();
00033
00037 void publishClustering(const Frame frame);
00038
00039 protected:
00040
00044 void drawKeypointsClustering(const Frame frame);
00045
00046 private:
00047
00048 ros::Publisher pub_clustering_;
00049
00050 };
00051
00052 }
00053
00054 #endif // PUBLISHER_H