Classes | Namespaces | Typedefs | Functions
planning_scene.h File Reference
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/transforms/transforms.h>
#include <moveit/collision_detection/collision_detector_allocator.h>
#include <moveit/collision_detection/world_diff.h>
#include <moveit/collision_detection/collision_env.h>
#include <moveit/kinematic_constraints/kinematic_constraint.h>
#include <moveit/kinematics_base/kinematics_base.h>
#include <moveit/robot_trajectory/robot_trajectory.h>
#include <moveit/macros/class_forward.h>
#include <moveit_msgs/PlanningScene.h>
#include <moveit_msgs/RobotTrajectory.h>
#include <moveit_msgs/Constraints.h>
#include <moveit_msgs/PlanningSceneComponents.h>
#include <octomap_msgs/OctomapWithPose.h>
#include <boost/noncopyable.hpp>
#include <boost/function.hpp>
#include <boost/concept_check.hpp>
#include <memory>
#include <moveit/moveit_planning_scene_export.h>
Include dependency graph for planning_scene.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  planning_scene::PlanningScene::CollisionDetector
 
class  planning_scene::PlanningScene
 This class maintains the representation of the environment as seen by a planning instance. The environment geometry, the robot geometry and state are maintained. More...
 

Namespaces

 planning_scene
 This namespace includes the central class for representing planning scenes.
 

Typedefs

using planning_scene::MotionFeasibilityFn = boost::function< bool(const moveit::core::RobotState &, const moveit::core::RobotState &, bool)>
 This is the function signature for additional feasibility checks to be imposed on motions segments between states (in addition to respecting constraints and collision avoidance). The order of the arguments matters: the notion of feasibility is to be checked for motion segments that start at the first state and end at the second state. The third argument indicates whether the check should be verbose or not. More...
 
using planning_scene::ObjectColorMap = std::map< std::string, std_msgs::ColorRGBA >
 A map from object names (e.g., attached bodies, collision objects) to their colors. More...
 
using planning_scene::ObjectTypeMap = std::map< std::string, object_recognition_msgs::ObjectType >
 A map from object names (e.g., attached bodies, collision objects) to their types. More...
 
typedef boost::function< bool(const moveit::core::RobotState &, bool)> planning_scene::StateFeasibilityFn
 This is the function signature for additional feasibility checks to be imposed on states (in addition to respecting constraints and collision avoidance). The first argument is the state to check the feasibility for, the second one is whether the check should be verbose or not. More...
 

Functions

 planning_scene::MOVEIT_CLASS_FORWARD (PlanningScene)
 


moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Thu Apr 18 2024 02:23:41