Helper class implementing infrastructure code many local planner implementations may need.
More...
#include <local_planner_util.h>
Helper class implementing infrastructure code many local planner implementations may need.
Definition at line 92 of file local_planner_util.h.
◆ LocalPlannerUtil()
base_local_planner::LocalPlannerUtil::LocalPlannerUtil |
( |
| ) |
|
|
inline |
◆ ~LocalPlannerUtil()
base_local_planner::LocalPlannerUtil::~LocalPlannerUtil |
( |
| ) |
|
|
inline |
◆ getCostmap()
◆ getCurrentLimits()
◆ getGlobalFrame()
std::string base_local_planner::LocalPlannerUtil::getGlobalFrame |
( |
| ) |
|
|
inline |
◆ getGoal()
bool base_local_planner::LocalPlannerUtil::getGoal |
( |
geometry_msgs::PoseStamped & |
goal_pose | ) |
|
◆ getLocalPlan()
bool base_local_planner::LocalPlannerUtil::getLocalPlan |
( |
const geometry_msgs::PoseStamped & |
global_pose, |
|
|
std::vector< geometry_msgs::PoseStamped > & |
transformed_plan |
|
) |
| |
◆ initialize()
◆ reconfigureCB()
void base_local_planner::LocalPlannerUtil::reconfigureCB |
( |
LocalPlannerLimits & |
config, |
|
|
bool |
restore_defaults |
|
) |
| |
◆ setPlan()
bool base_local_planner::LocalPlannerUtil::setPlan |
( |
const std::vector< geometry_msgs::PoseStamped > & |
orig_global_plan | ) |
|
◆ costmap_
◆ default_limits_
◆ global_frame_
std::string base_local_planner::LocalPlannerUtil::global_frame_ |
|
private |
◆ global_plan_
std::vector<geometry_msgs::PoseStamped> base_local_planner::LocalPlannerUtil::global_plan_ |
|
private |
◆ initialized_
bool base_local_planner::LocalPlannerUtil::initialized_ |
|
private |
◆ limits_
◆ limits_configuration_mutex_
boost::mutex base_local_planner::LocalPlannerUtil::limits_configuration_mutex_ |
|
private |
◆ name_
std::string base_local_planner::LocalPlannerUtil::name_ |
|
private |
◆ setup_
bool base_local_planner::LocalPlannerUtil::setup_ |
|
private |
◆ tf_
The documentation for this class was generated from the following files: