moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
This fix start state collision adapter will attempt to sample a new collision-free configuration near a specified configuration (in collision) by perturbing the joint values by a small amount. More...
Public Member Functions | |
void | initialize (const rclcpp::Node::SharedPtr &, const std::string &) override |
Initialize parameters using the passed Node and parameter namespace. More... | |
std::string | getDescription () const override |
Get a description of this adapter. More... | |
bool | adaptAndPlan (const PlannerFn &planner, const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res) const override |
Adapt the planning request if needed, call the planner function planner and update the planning response if needed. If the response is changed, the index values of the states added without planning are added to added_path_index. More... | |
![]() | |
bool | adaptAndPlan (const planning_interface::PlannerManagerPtr &planner, const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res) const |
Adapt the planning request if needed, call the planner function planner and update the planning response if needed. If the response is changed, the index values of the states added without planning are added to added_path_index. More... | |
Additional Inherited Members | |
![]() | |
using | PlannerFn = std::function< bool(const planning_scene::PlanningSceneConstPtr &, const planning_interface::MotionPlanRequest &, planning_interface::MotionPlanResponse &)> |
Functional interface to call a planning function. More... | |
This fix start state collision adapter will attempt to sample a new collision-free configuration near a specified configuration (in collision) by perturbing the joint values by a small amount.
Definition at line 59 of file fix_start_state_path_constraints.cpp.
|
inlineoverridevirtual |
Adapt the planning request if needed, call the planner function planner and update the planning response if needed. If the response is changed, the index values of the states added without planning are added to added_path_index.
planner | Pointer to the planner used to solve the passed problem |
planning_scene | Representation of the environment for the planning |
req | Motion planning request with a set of constraints |
res | Reference to which the generated motion plan response is written to |
Implements planning_request_adapter::PlanningRequestAdapter.
Definition at line 71 of file fix_start_state_path_constraints.cpp.
|
inlineoverridevirtual |
Get a description of this adapter.
Implements planning_request_adapter::PlanningRequestAdapter.
Definition at line 66 of file fix_start_state_path_constraints.cpp.
|
inlineoverridevirtual |
Initialize parameters using the passed Node and parameter namespace.
node | Node instance used by the adapter |
parameter_namespace | Parameter namespace for adapter If no initialization is needed, simply implement as empty |
Implements planning_request_adapter::PlanningRequestAdapter.
Definition at line 62 of file fix_start_state_path_constraints.cpp.