, including all inherited members.
costmap_loader_ | locomotor::Locomotor | [protected] |
doCostmapUpdate(nav_core2::Costmap &costmap, Executor &result_ex, CostmapUpdateCallback cb, CostmapUpdateExceptionCallback fail_cb) | locomotor::Locomotor | [protected] |
getCurrentGlobalPlanner() | locomotor::Locomotor | [inline] |
getCurrentGlobalPlannerName() const | locomotor::Locomotor | [inline] |
getCurrentLocalPlanner() | locomotor::Locomotor | [inline] |
getCurrentLocalPlannerName() const | locomotor::Locomotor | [inline] |
getGlobalCostmap() const | locomotor::Locomotor | [inline] |
getGlobalPlannerNames() const | locomotor::Locomotor | [inline] |
getGlobalRobotPose() const | locomotor::Locomotor | [inline] |
getLocalCostmap() const | locomotor::Locomotor | [inline] |
getLocalPlannerNames() const | locomotor::Locomotor | [inline] |
getLocalRobotPose() const | locomotor::Locomotor | [inline] |
getNavigationState() const | locomotor::Locomotor | [inline] |
getRobotPose(const std::string &target_frame) const | locomotor::Locomotor | [protected] |
getTFListener() const | locomotor::Locomotor | [inline] |
global_costmap_ | locomotor::Locomotor | [protected] |
global_planner_mux_ | locomotor::Locomotor | [protected] |
initializeGlobalCostmap(Executor &ex) | locomotor::Locomotor | |
initializeGlobalPlanners(Executor &ex) | locomotor::Locomotor | |
initializeLocalCostmap(Executor &ex) | locomotor::Locomotor | |
initializeLocalPlanners(Executor &ex) | locomotor::Locomotor | |
local_costmap_ | locomotor::Locomotor | [protected] |
local_planner_mux_ | locomotor::Locomotor | [protected] |
Locomotor(const ros::NodeHandle &private_nh) | locomotor::Locomotor | [explicit] |
makeGlobalPlan(Executor &result_ex, GlobalPlanCallback cb, PlannerExceptionCallback fail_cb) | locomotor::Locomotor | [protected] |
makeLocalPlan(Executor &result_ex, LocalPlanCallback cb, PlannerExceptionCallback fail_cb, NavigationCompleteCallback complete_cb) | locomotor::Locomotor | [protected] |
odom_sub_ | locomotor::Locomotor | [protected] |
path_pub_ | locomotor::Locomotor | [protected] |
private_nh_ | locomotor::Locomotor | [protected] |
publishPath(const nav_2d_msgs::Path2D &global_plan) | locomotor::Locomotor | [inline] |
publishTwist(const nav_2d_msgs::Twist2DStamped &command) | locomotor::Locomotor | [inline] |
requestGlobalCostmapUpdate(Executor &work_ex, Executor &result_ex, CostmapUpdateCallback cb=nullptr, CostmapUpdateExceptionCallback fail_cb=nullptr) | locomotor::Locomotor | |
requestGlobalPlan(Executor &work_ex, Executor &result_ex, GlobalPlanCallback cb=nullptr, PlannerExceptionCallback fail_cb=nullptr) | locomotor::Locomotor | |
requestLocalCostmapUpdate(Executor &work_ex, Executor &result_ex, CostmapUpdateCallback cb=nullptr, CostmapUpdateExceptionCallback fail_cb=nullptr) | locomotor::Locomotor | |
requestLocalPlan(Executor &work_ex, Executor &result_ex, LocalPlanCallback cb=nullptr, PlannerExceptionCallback fail_cb=nullptr, NavigationCompleteCallback complete_cb=nullptr) | locomotor::Locomotor | |
requestNavigationFailure(Executor &result_ex, const locomotor_msgs::ResultCode &result, NavigationFailureCallback cb=nullptr) | locomotor::Locomotor | |
robot_base_frame_ | locomotor::Locomotor | [protected] |
setGoal(nav_2d_msgs::Pose2DStamped goal) | locomotor::Locomotor | [virtual] |
state_ | locomotor::Locomotor | [protected] |
switchLocalPlannerCallback(const std::string &old_planner, const std::string &new_planner) | locomotor::Locomotor | [protected, virtual] |
tf_ | locomotor::Locomotor | [protected] |
twist_pub_ | locomotor::Locomotor | [protected] |
use_latest_pose_ | locomotor::Locomotor | [protected] |
useGlobalPlanner(const std::string &name) | locomotor::Locomotor | [inline] |
useLocalPlanner(const std::string &name) | locomotor::Locomotor | [inline] |