Classes | Typedefs
planning_scene Namespace Reference

This namespace includes the central class for representing planning contexts. More...

Classes

class  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...
class  SceneTransforms

Typedefs

typedef boost::function< bool(const
robot_state::RobotState
&, const
robot_state::RobotState
&, bool)> 
MotionFeasibilityFn
 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.
typedef std::map< std::string,
std_msgs::ColorRGBA > 
ObjectColorMap
 A map from object names (e.g., attached bodies, collision objects) to their colors.
typedef std::map< std::string,
object_recognition_msgs::ObjectType > 
ObjectTypeMap
 A map from object names (e.g., attached bodies, collision objects) to their types.
typedef boost::shared_ptr
< const PlanningScene
PlanningSceneConstPtr
typedef boost::shared_ptr
< PlanningScene
PlanningScenePtr
typedef boost::function< bool(const
robot_state::RobotState
&, bool)> 
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.

Detailed Description

This namespace includes the central class for representing planning contexts.


Typedef Documentation

typedef boost::function<bool(const robot_state::RobotState&, const robot_state::RobotState&, bool)> planning_scene::MotionFeasibilityFn

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.

Definition at line 74 of file planning_scene.h.

typedef std::map<std::string, std_msgs::ColorRGBA> planning_scene::ObjectColorMap

A map from object names (e.g., attached bodies, collision objects) to their colors.

Definition at line 77 of file planning_scene.h.

typedef std::map<std::string, object_recognition_msgs::ObjectType> planning_scene::ObjectTypeMap

A map from object names (e.g., attached bodies, collision objects) to their types.

Definition at line 80 of file planning_scene.h.

typedef boost::shared_ptr<const PlanningScene> planning_scene::PlanningSceneConstPtr

Definition at line 65 of file planning_scene.h.

typedef boost::shared_ptr<PlanningScene> planning_scene::PlanningScenePtr

Definition at line 63 of file planning_scene.h.

typedef boost::function<bool(const robot_state::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.

Definition at line 69 of file planning_scene.h.



moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Mon Oct 6 2014 02:24:48