#include <actionlib/client/simple_action_client.h>
#include <actionlib/server/simple_action_server.h>
#include <object_recognition_gui/ObjectRecognitionGuiAction.h>
#include <rgbd_assembler/RgbdAssembly.h>
#include <tabletop_object_detector/TabletopSegmentation.h>
#include <tabletop_object_detector/TabletopObjectRecognition.h>
#include <tabletop_object_detector/Table.h>
#include <tabletop_collision_map_processing/collision_map_interface.h>
#include <object_manipulator/tools/mechanism_interface.h>
#include <pr2_interactive_object_detection/UserCommandAction.h>
#include <pr2_interactive_object_detection/msg_saver.h>
#include <stereo_msgs/DisparityImage.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/CameraInfo.h>
#include <visualization_msgs/Marker.h>
Go to the source code of this file.
Classes | |
class | InteractiveObjDetBackend |
Does all the work for the Interactive Object Recognition GUI. More... |