#include <stdexcept>
#include <ros/ros.h>
#include <actionlib/client/simple_action_client.h>
#include <household_objects_database_msgs/DatabaseModelPose.h>
#include <sensor_msgs/PointCloud.h>
#include <sensor_msgs/PointCloud2.h>
#include <arm_navigation_msgs/Shape.h>
#include <tabletop_object_detector/Table.h>
#include <tabletop_object_detector/TabletopDetectionResult.h>
#include <object_manipulation_msgs/ClusterBoundingBox.h>
Go to the source code of this file.
Classes | |
class | tabletop_collision_map_processing::CollisionMapException |
General base class for all exceptions originating in the collision map interface. More... | |
class | tabletop_collision_map_processing::CollisionMapInterface |
Provides the collision map related services needed by object grasping. More... | |
Namespaces | |
namespace | tabletop_collision_map_processing |