shortest_path.cpp File Reference

#include <occupancy_grid_utils/shortest_path.h>
#include <occupancy_grid_utils/coordinate_conversions.h>
#include <occupancy_grid_utils/NavigationFunction.h>
#include <boost/shared_ptr.hpp>
#include <boost/optional.hpp>
#include <set>
#include <ros/assert.h>
#include <queue>
Include dependency graph for shortest_path.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  occupancy_grid_utils::InflationQueueItem
struct  occupancy_grid_utils::PQItem
struct  occupancy_grid_utils::QueueItem
struct  occupancy_grid_utils::ShortestPathResult

Namespaces

namespace  occupancy_grid_utils

Functions

boost::optional< double > occupancy_grid_utils::distance (ResultPtr shortest_path_result, const Cell &dest)
 From result of single-source shortest paths, extract distance to some destination.
boost::optional< Pathoccupancy_grid_utils::extractPath (ResultPtr shortest_path_result, const Cell &dest)
 Extract a path from the result of single-source shortest paths.
GridPtr occupancy_grid_utils::inflateObstacles (const nm::OccupancyGrid &g, const double r, const bool allow_unknown)
double occupancy_grid_utils::manhattanHeuristic (const Cell &c1, const Cell &c2)
bool occupancy_grid_utils::myGt (const signed char x, const signed char y)
bool occupancy_grid_utils::operator< (const QueueItem &i1, const QueueItem &i2)
optional< AStarResult > occupancy_grid_utils::shortestPath (const nm::OccupancyGrid &g, const Cell &src, const Cell &dest)
ResultPtr occupancy_grid_utils::shortestPathResultFromMessage (const NavigationFunction &msg)
 Convert a shortest path result from a ros message.
NavigationFunction occupancy_grid_utils::shortestPathResultToMessage (ResultPtr res)
 Convert a shortest path result to a ros message.
ResultPtr occupancy_grid_utils::singleSourceShortestPaths (const nm::OccupancyGrid &g, const Cell &src, const TerminationCondition &t)
ResultPtr occupancy_grid_utils::singleSourceShortestPaths (const nm::OccupancyGrid &g, const Cell &src)

Detailed Description

Implementation of shortest_path.h

Author:
Bhaskara Marthi

Definition in file shortest_path.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Friends


occupancy_grid_utils
Author(s): Bhaskara Marthi
autogenerated on Fri Jan 11 10:07:09 2013