, including all inherited members.
adjustPlanResolution(const std::vector< geometry_msgs::PoseStamped > &global_plan_in, std::vector< geometry_msgs::PoseStamped > &global_plan_out, double resolution) | base_local_planner::MapGrid | [static] |
commonInit() | base_local_planner::MapGrid | |
computeGoalDistance(std::queue< MapCell * > &dist_queue, const costmap_2d::Costmap2D &costmap) | base_local_planner::MapGrid | |
computeTargetDistance(std::queue< MapCell * > &dist_queue, const costmap_2d::Costmap2D &costmap) | base_local_planner::MapGrid | |
getCell(unsigned int x, unsigned int y) | base_local_planner::MapGrid | [inline] |
getIndex(int x, int y) | base_local_planner::MapGrid | |
goal_x_ | base_local_planner::MapGrid | |
goal_y_ | base_local_planner::MapGrid | |
map_ | base_local_planner::MapGrid | [private] |
MapGrid() | base_local_planner::MapGrid | |
MapGrid(unsigned int size_x, unsigned int size_y) | base_local_planner::MapGrid | |
MapGrid(const MapGrid &mg) | base_local_planner::MapGrid | |
obstacleCosts() | base_local_planner::MapGrid | [inline] |
operator()(unsigned int x, unsigned int y) | base_local_planner::MapGrid | [inline] |
operator()(unsigned int x, unsigned int y) const | base_local_planner::MapGrid | [inline] |
operator=(const MapGrid &mg) | base_local_planner::MapGrid | |
resetPathDist() | base_local_planner::MapGrid | |
setLocalGoal(const costmap_2d::Costmap2D &costmap, const std::vector< geometry_msgs::PoseStamped > &global_plan) | base_local_planner::MapGrid | |
setTargetCells(const costmap_2d::Costmap2D &costmap, const std::vector< geometry_msgs::PoseStamped > &global_plan) | base_local_planner::MapGrid | |
size_x_ | base_local_planner::MapGrid | |
size_y_ | base_local_planner::MapGrid | |
sizeCheck(unsigned int size_x, unsigned int size_y) | base_local_planner::MapGrid | |
unreachableCellCosts() | base_local_planner::MapGrid | [inline] |
updatePathCell(MapCell *current_cell, MapCell *check_cell, const costmap_2d::Costmap2D &costmap) | base_local_planner::MapGrid | [inline] |
~MapGrid() | base_local_planner::MapGrid | [inline] |