Public Member Functions | |
virtual bool | adaptAndPlan (const PlannerFn &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 |
FixStartStateBounds () | |
virtual std::string | getDescription () const |
Static Public Attributes | |
static const std::string | BOUNDS_PARAM_NAME = "start_state_max_bounds_error" |
static const std::string | DT_PARAM_NAME = "start_state_max_dt" |
Private Attributes | |
double | bounds_dist_ |
double | max_dt_offset_ |
ros::NodeHandle | nh_ |
Definition at line 47 of file fix_start_state_bounds.cpp.
Definition at line 54 of file fix_start_state_bounds.cpp.
virtual bool default_planner_request_adapters::FixStartStateBounds::adaptAndPlan | ( | const PlannerFn & | 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 [inline, virtual] |
Implements planning_request_adapter::PlanningRequestAdapter.
Definition at line 76 of file fix_start_state_bounds.cpp.
virtual std::string default_planner_request_adapters::FixStartStateBounds::getDescription | ( | ) | const [inline, virtual] |
Reimplemented from planning_request_adapter::PlanningRequestAdapter.
Definition at line 73 of file fix_start_state_bounds.cpp.
double default_planner_request_adapters::FixStartStateBounds::bounds_dist_ [private] |
Definition at line 203 of file fix_start_state_bounds.cpp.
const std::string default_planner_request_adapters::FixStartStateBounds::BOUNDS_PARAM_NAME = "start_state_max_bounds_error" [static] |
Definition at line 51 of file fix_start_state_bounds.cpp.
const std::string default_planner_request_adapters::FixStartStateBounds::DT_PARAM_NAME = "start_state_max_dt" [static] |
Definition at line 52 of file fix_start_state_bounds.cpp.
Definition at line 204 of file fix_start_state_bounds.cpp.
Definition at line 202 of file fix_start_state_bounds.cpp.