35 #ifndef DLUX_PLUGINS_ASTAR_H 36 #define DLUX_PLUGINS_ASTAR_H 56 const geometry_msgs::Pose2D& start,
const geometry_msgs::Pose2D& goal)
override;
108 #endif // DLUX_PLUGINS_ASTAR_H
bool operator()(const QueueEntry &a, const QueueEntry &b) const
unsigned int updatePotentials(dlux_global_planner::PotentialGrid &potential_grid, const geometry_msgs::Pose2D &start, const geometry_msgs::Pose2D &goal) override
Helper Class for sorting indexes by their heuristic.
double minimum_requeue_change_
Potential calculator that explores using a distance heuristic (A*) but not the kernel function...
float getHeuristicValue(const nav_grid::Index &index, const nav_grid::Index &start_index) const
Calculate the heuristic value for a particular cell.
Comparator for sorting the QueueEntrys.
std::priority_queue< QueueEntry, std::vector< QueueEntry >, QueueEntryComparator > AStarQueue
std::shared_ptr< CostInterpreter > Ptr
bool manhattan_heuristic_
std::shared_ptr< Costmap > Ptr
QueueEntry(nav_grid::Index index, float heuristic)
void initialize(ros::NodeHandle &private_nh, nav_core2::Costmap::Ptr costmap, dlux_global_planner::CostInterpreter::Ptr cost_interpreter) override
void add(dlux_global_planner::PotentialGrid &potential_grid, double prev_potential, const nav_grid::Index &index, const nav_grid::Index &start_index)
Calculate the potential for index if not calculated already.