Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014 #include <QGridLayout>
00015 #include <QVBoxLayout>
00016 #include <QDockWidget>
00017
00018 #include <ostream>
00019 #include <sensor_msgs/Image.h>
00020
00021 #include "ObjectLearningTab.h"
00022
00023 #define THIS ObjectLearningTab
00024
00025
00026 THIS::THIS( ros::NodeHandle *nodeHandle, QWidget *parent ) : QWidget( parent ) {
00027
00028 ObjectLearningControl* learningControl = new ObjectLearningControl( nodeHandle, this );
00029
00030
00031 QGridLayout* mainLayout = new QGridLayout();
00032
00033 QVBoxLayout* leftLayout = new QVBoxLayout();
00034 leftLayout->setContentsMargins( 1,1,1,1 );
00035
00036 QVBoxLayout* rightLayout = new QVBoxLayout();
00037 rightLayout->setContentsMargins( 1,1,1,1 );
00038
00039
00040 m_ImagesControl=new ObjectImagesControl( nodeHandle, this );
00041 rightLayout->addWidget( m_ImagesControl );
00042 rightLayout->setStretchFactor( m_ImagesControl, 2 );
00043
00044
00045 mainLayout->setColumnStretch(0,4);
00046 mainLayout->setColumnStretch(1,2);
00047
00048 mainLayout->setContentsMargins( 1,1,1,1 );
00049
00050 mainLayout->addLayout( leftLayout, 0, 0 );
00051 mainLayout->addLayout( rightLayout, 0, 1 );
00052 mainLayout->addWidget( learningControl, 1, 0, 1, 2 );
00053
00054 setLayout( mainLayout );
00055 }
00056
00057
00058
00059 void THIS::processLearningStatus(std::vector<std::string> filenames, std::string objType)
00060 {
00061 m_ImagesControl->updateImageTable(filenames, objType);
00062 }
00063
00064 #undef THIS