|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
The CheckStartStateBounds adapter validates if the start state is within the joint limits specified in the URDF. More...


Public Member Functions | |
| CheckStartStateBounds () | |
| ~CheckStartStateBounds () override=default | |
| void | initialize (const rclcpp::Node::SharedPtr &node, const std::string ¶meter_namespace) override |
| Initialize parameters using the passed Node and parameter namespace. | |
| std::string | getDescription () const override |
| Get a description of this adapter. | |
| moveit::core::MoveItErrorCode | adapt (const planning_scene::PlanningSceneConstPtr &planning_scene, planning_interface::MotionPlanRequest &req) const override |
| Adapt the planning request. | |
Public Member Functions inherited from planning_interface::PlanningRequestAdapter | |
| virtual | ~PlanningRequestAdapter ()=default |
The CheckStartStateBounds adapter validates if the start state is within the joint limits specified in the URDF.
Definition at line 62 of file check_start_state_bounds.cpp.
|
inline |
Definition at line 65 of file check_start_state_bounds.cpp.
|
overridedefault |
|
inlineoverridevirtual |
Adapt the planning request.
| planning_scene | Representation of the environment for the planning |
| req | Motion planning request with a set of constraints |
Implements planning_interface::PlanningRequestAdapter.
Definition at line 81 of file check_start_state_bounds.cpp.

|
inlineoverridevirtual |
Get a description of this adapter.
Implements planning_interface::PlanningRequestAdapter.
Definition at line 76 of file check_start_state_bounds.cpp.

|
inlineoverridevirtual |
Initialize parameters using the passed Node and parameter namespace.
| node | Node instance used by the adapter |
| parameter_namespace | Parameter namespace for adapter |
The default implementation is empty
Reimplemented from planning_interface::PlanningRequestAdapter.
Definition at line 71 of file check_start_state_bounds.cpp.