35 #ifndef DLUX_PLUGINS_DIJKSTRA_H 36 #define DLUX_PLUGINS_DIJKSTRA_H 52 const geometry_msgs::Pose2D& start,
const geometry_msgs::Pose2D& goal)
override;
66 #endif // DLUX_PLUGINS_DIJKSTRA_H void add(dlux_global_planner::PotentialGrid &potential_grid, nav_grid::Index next_index)
Calculate the potential for next_index if not calculated already.
unsigned int updatePotentials(dlux_global_planner::PotentialGrid &potential_grid, const geometry_msgs::Pose2D &start, const geometry_msgs::Pose2D &goal) override
Potential calculator that explores the potential breadth first while using the kernel function...
std::queue< nav_grid::Index > queue_