#include "planning_environment/monitors/collision_space_monitor.h"#include "planning_environment/util/construct_object.h"#include <geometric_shapes/shapes.h>#include <geometric_shapes_msgs/Shape.h>#include <geometry_msgs/PointStamped.h>#include <geometry_msgs/PoseStamped.h>#include <vector>#include <LinearMath/btVector3.h>#include "aiTypes.h"#include <boost/bind.hpp>#include <climits>#include <sstream>

Go to the source code of this file.
Namespaces | |
| namespace | planning_environment |
Functions | |
| static double | planning_environment::maxCoord (const geometry_msgs::Point32 &point) |
Variables | |
| static const std::string | GET_COLLISION_OBJECTS_SERVICE_NAME = "get_collision_objects" |
| static const std::string | GET_CURRENT_ALLOWED_COLLISION_MATRIX_SERVICE_NAME = "get_current_allowed_collision_matrix" |
| static const std::string | REVERT_ALLOWED_COLLISIONS_SERVICE_NAME = "revert_allowed_collisions" |
| static const std::string | SET_ALLOWED_COLLISIONS_SERVICE_NAME = "set_allowed_collisions" |
const std::string GET_COLLISION_OBJECTS_SERVICE_NAME = "get_collision_objects" [static] |
Definition at line 46 of file collision_space_monitor.cpp.
const std::string GET_CURRENT_ALLOWED_COLLISION_MATRIX_SERVICE_NAME = "get_current_allowed_collision_matrix" [static] |
Definition at line 47 of file collision_space_monitor.cpp.
const std::string REVERT_ALLOWED_COLLISIONS_SERVICE_NAME = "revert_allowed_collisions" [static] |
Definition at line 49 of file collision_space_monitor.cpp.
const std::string SET_ALLOWED_COLLISIONS_SERVICE_NAME = "set_allowed_collisions" [static] |
Definition at line 48 of file collision_space_monitor.cpp.