#include <boost/scoped_ptr.hpp>
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <geometry_msgs/PoseArray.h>
#include <actionlib/client/simple_action_client.h>
#include <object_recognition_msgs/GetObjectInformation.h>
#include <object_recognition_msgs/ObjectRecognitionAction.h>
#include "romeo_moveit_actions/metablock.hpp"
#include "romeo_moveit_actions/evaluation.hpp"
Go to the source code of this file.
Classes | |
class | moveit_simple_actions::ObjProcessor |
Class for processing objects recognized by ORK. More... | |
Namespaces | |
namespace | moveit_simple_actions |
Typedefs | |
typedef object_recognition_msgs::GetObjectInformation | GetObjInfo |
typedef actionlib::SimpleActionClient < object_recognition_msgs::ObjectRecognitionAction > | ObjRecoActionClient |
typedef object_recognition_msgs::RecognizedObjectArray | RecognizedObjArray |
typedef object_recognition_msgs::GetObjectInformation GetObjInfo |
Definition at line 39 of file objprocessing.hpp.
typedef actionlib::SimpleActionClient<object_recognition_msgs::ObjectRecognitionAction> ObjRecoActionClient |
Definition at line 38 of file objprocessing.hpp.
typedef object_recognition_msgs::RecognizedObjectArray RecognizedObjArray |
Definition at line 37 of file objprocessing.hpp.