This is the complete list of members for
dlux_plugins::AStar, including all inherited members.
| add(dlux_global_planner::PotentialGrid &potential_grid, double prev_potential, const nav_grid::Index &index, const nav_grid::Index &start_index) | dlux_plugins::AStar | [protected] |
| cost_interpreter_ | dlux_global_planner::PotentialCalculator | [protected] |
| getHeuristicValue(const nav_grid::Index &index, const nav_grid::Index &start_index) const | dlux_plugins::AStar | [protected] |
| initialize(ros::NodeHandle &private_nh, nav_core2::Costmap::Ptr costmap, dlux_global_planner::CostInterpreter::Ptr cost_interpreter) override | dlux_plugins::AStar | [virtual] |
| manhattan_heuristic_ | dlux_plugins::AStar | [protected] |
| minimum_requeue_change_ | dlux_plugins::AStar | [protected] |
| PotentialCalculator() | dlux_global_planner::PotentialCalculator | |
| queue_ | dlux_plugins::AStar | [protected] |
| updatePotentials(dlux_global_planner::PotentialGrid &potential_grid, const geometry_msgs::Pose2D &start, const geometry_msgs::Pose2D &goal) override | dlux_plugins::AStar | |
| dlux_global_planner::PotentialCalculator::updatePotentials(PotentialGrid &potential_grid, const geometry_msgs::Pose2D &start, const geometry_msgs::Pose2D &goal)=0 | dlux_global_planner::PotentialCalculator | [pure virtual] |
| use_kernel_ | dlux_plugins::AStar | [protected] |
| ~PotentialCalculator() | dlux_global_planner::PotentialCalculator | [virtual] |