Implements a widget to control the creation of new templates for object recognition. More...
#include <ObjectLearningControl.h>
Public Slots | |
| void | grabBackgroundImage () |
| request image and wait | |
| void | grabForegroundImage () |
| request image from camera | |
| void | loadBackgroundImage () |
| request image and wait | |
| void | loadForegroundImage () |
| request image from camera | |
| void | setBorderSize (int value) |
| void | setCameraId (ImageSources::SourceId cameraId) |
| void | setIsolateLargestSegment (int state) |
| void | setOpenRadius (int) |
| void | setThreshold (int) |
Signals | |
| void | imageSaved (QString fileName) |
Public Member Functions | |
| ObjectLearningControl (ros::NodeHandle *nh, QWidget *parent=0) | |
| ~ObjectLearningControl () | |
Private Attributes | |
| QPushButton * | grabBackgroundButton |
| QPushButton * | grabForegroundButton |
| QPushButton * | loadBackgroundButton |
| QPushButton * | loadForegroundButton |
| ImageSources::SourceId | m_CameraId |
| QString | m_LastImageFolder |
| QString | m_LastOpenPath |
| ros::Publisher | m_ORLearnCommandPublisher |
| bool | m_Ready |
Implements a widget to control the creation of new templates for object recognition.
Definition at line 47 of file ObjectLearningControl.h.
| ObjectLearningControl::ObjectLearningControl | ( | ros::NodeHandle * | nh, |
| QWidget * | parent = 0 |
||
| ) |
Instantiates its tab widget.
| [in] | parent | The QWidget the contains this QWidget. |
Does Nothing
| void ObjectLearningControl::grabBackgroundImage | ( | ) | [slot] |
request image and wait
| void ObjectLearningControl::grabForegroundImage | ( | ) | [slot] |
request image from camera
| void ObjectLearningControl::imageSaved | ( | QString | fileName | ) | [signal] |
| void ObjectLearningControl::loadBackgroundImage | ( | ) | [slot] |
request image and wait
| void ObjectLearningControl::loadForegroundImage | ( | ) | [slot] |
request image from camera
| void ObjectLearningControl::setBorderSize | ( | int | value | ) | [slot] |
| void ObjectLearningControl::setCameraId | ( | ImageSources::SourceId | cameraId | ) | [slot] |
| void ObjectLearningControl::setIsolateLargestSegment | ( | int | state | ) | [slot] |
| void ObjectLearningControl::setOpenRadius | ( | int | ) | [slot] |
| void ObjectLearningControl::setThreshold | ( | int | ) | [slot] |
QPushButton* ObjectLearningControl::grabBackgroundButton [private] |
Definition at line 92 of file ObjectLearningControl.h.
QPushButton* ObjectLearningControl::grabForegroundButton [private] |
Definition at line 93 of file ObjectLearningControl.h.
QPushButton* ObjectLearningControl::loadBackgroundButton [private] |
Definition at line 95 of file ObjectLearningControl.h.
QPushButton* ObjectLearningControl::loadForegroundButton [private] |
Definition at line 96 of file ObjectLearningControl.h.
Definition at line 98 of file ObjectLearningControl.h.
QString ObjectLearningControl::m_LastImageFolder [private] |
Definition at line 90 of file ObjectLearningControl.h.
QString ObjectLearningControl::m_LastOpenPath [private] |
Definition at line 101 of file ObjectLearningControl.h.
Definition at line 88 of file ObjectLearningControl.h.
bool ObjectLearningControl::m_Ready [private] |
Definition at line 104 of file ObjectLearningControl.h.