#include "object_segmentation_gui/ObjectSegmentationGuiAction.h"
#include "object_segmentation_gui/utils.h"
#include "active_realtime_segmentation/fgbgsegment.h"
#include "active_realtime_segmentation/pyra/tpimage.h"
#include <sensor_msgs/Image.h>
#include <boost/thread/mutex.hpp>
#include <boost/thread/thread.hpp>
#include <boost/thread/condition_variable.hpp>
#include <deque>
Go to the source code of this file.
Classes | |
struct | object_segmentation_gui::ObjectSegmenter::Action |
struct | object_segmentation_gui::ObjectSegmenter::Box2D |
class | object_segmentation_gui::ObjectSegmenter |
Namespaces | |
namespace | object_segmentation_gui |
Typedefs | |
typedef geometry_msgs::Point32 | object_segmentation_gui::Point |