Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014 #ifndef ObjectLearningTab_H
00015 #define ObjectLearningTab_H
00016
00017 #include <set>
00018 #include <QTreeWidget>
00019
00020 #include <ros/ros.h>
00021 #include <sensor_msgs/Image.h>
00022
00023 #include "../../Widgets/ObjectRecognition/ObjectImagesControl.h"
00024 #include "../../Widgets/ObjectRecognition/ObjectLearningControl.h"
00025
00026 class ImageStreamDisplay;
00027
00033 class ObjectLearningTab : public QWidget {
00034
00035 Q_OBJECT
00036
00037 public:
00038
00042 ObjectLearningTab(ros::NodeHandle *nodeHandle, QWidget *parent = 0 );
00043
00045 ~ObjectLearningTab() {}
00046
00048 void updateCameraImage(const unsigned char* image, unsigned width, unsigned height);
00049
00050 public slots:
00051 void processLearningStatus(std::vector<std::string> filenames, std::string objType);
00052
00053 private:
00054
00055
00056 ObjectImagesControl* m_ImagesControl;
00057 };
00058
00059
00060 #endif