Public Member Functions | |
bool | adaptAndPlan (PlannerFn const &planner, planning_scene::PlanningSceneConstPtr const &planning_scene, planning_interface::MotionPlanRequest const &req, planning_interface::MotionPlanResponse &res, std::vector< std::size_t > &added_path_index) 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... | |
void | initialize (ros::NodeHandle const &) override |
Initialize parameters using the passed NodeHandle if no initialization is needed, simply implement as empty. More... | |
Public Member Functions inherited from planning_request_adapter::PlanningRequestAdapter | |
bool | adaptAndPlan (const planning_interface::PlannerManagerPtr &planner, const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res) const |
bool | adaptAndPlan (const planning_interface::PlannerManagerPtr &planner, const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res, std::vector< std::size_t > &added_path_index) const |
virtual std::string | getDescription () const |
Get a short string that identifies the planning request adapter. More... | |
PlanningRequestAdapter () | |
virtual | ~PlanningRequestAdapter () |
Additional Inherited Members | |
Public Types inherited from planning_request_adapter::PlanningRequestAdapter | |
using | PlannerFn = boost::function< bool(const planning_scene::PlanningSceneConstPtr &, const planning_interface::MotionPlanRequest &, planning_interface::MotionPlanResponse &)> |
Definition at line 41 of file test_planning_request_adapter_chain.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.
Implements planning_request_adapter::PlanningRequestAdapter.
Definition at line 79 of file test_planning_request_adapter_chain.cpp.
|
inlineoverridevirtual |
Initialize parameters using the passed NodeHandle if no initialization is needed, simply implement as empty.
Implements planning_request_adapter::PlanningRequestAdapter.
Definition at line 76 of file test_planning_request_adapter_chain.cpp.