|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/robot_model/robot_model.hpp>#include <moveit/robot_state/robot_state.hpp>#include <moveit/transforms/transforms.hpp>#include <moveit/collision_detection/collision_env.hpp>#include <moveit/macros/class_forward.hpp>#include <geometric_shapes/bodies.h>#include <moveit_msgs/msg/constraints.hpp>#include <iostream>#include <vector>

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::KinematicConstraint |
| Base class for representing a kinematic constraint. More... | |
| class | kinematic_constraints::JointConstraint |
| Class for handling single DOF joint constraints. 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... | |
| 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... | |
Namespaces | |
| namespace | kinematic_constraints |
| Representation and evaluation of kinematic constraints. | |