#include <moveit/robot_model/robot_model.h>#include <moveit/robot_state/robot_state.h>#include <moveit/transforms/transforms.h>#include <moveit/collision_detection/collision_world.h>#include <geometric_shapes/bodies.h>#include <moveit_msgs/Constraints.h>#include <iostream>#include <vector>#include <boost/shared_ptr.hpp>

Go to the source code of this file.
Classes | |
| struct | kinematic_constraints::ConstraintEvaluationResult |
| Struct for containing the results of constraint evaluation. More... | |
| class | kinematic_constraints::JointConstraint |
| Class for handling single DOF joint constraints. More... | |
| class | kinematic_constraints::KinematicConstraint |
| Base class for representing a kinematic constraint. More... | |
| class | kinematic_constraints::KinematicConstraintSet |
| A class that contains many different constraints, and can check RobotState *versus the full set. A set is satisfied if and only if all constraints are satisfied. More... | |
| class | kinematic_constraints::OrientationConstraint |
| Class for constraints on the orientation of a link. More... | |
| class | kinematic_constraints::PositionConstraint |
| Class for constraints on the XYZ position of a link. More... | |
| class | kinematic_constraints::VisibilityConstraint |
| Class for constraints on the visibility relationship between a sensor and a target. More... | |
Namespaces | |
| namespace | kinematic_constraints |
Representation and evaluation of kinematic constraints. | |
Typedefs | |
| typedef boost::shared_ptr < const KinematicConstraint > | kinematic_constraints::KinematicConstraintConstPtr |
| boost::shared_ptr to a Const Kinematic Constraint | |
| typedef boost::shared_ptr < KinematicConstraint > | kinematic_constraints::KinematicConstraintPtr |
| boost::shared_ptr to a Kinematic Constraint | |
| typedef boost::shared_ptr < const KinematicConstraintSet > | kinematic_constraints::KinematicConstraintSetConstPtr |
| boost::shared_ptr to a KinematicConstraintSet Const | |
| typedef boost::shared_ptr < KinematicConstraintSet > | kinematic_constraints::KinematicConstraintSetPtr |
| boost::shared_ptr to a KinematicConstraintSetPtr | |