#include <boost/format.hpp>
#include <stdexcept>
#include <geometry_msgs/Point.h>
Go to the source code of this file.
Classes | |
struct | occupancy_grid_utils::CellOutOfBoundsException |
Exception for Cell off map. More... | |
struct | occupancy_grid_utils::GridUtilsException |
Base class for exceptions from this package. More... | |
struct | occupancy_grid_utils::PointOutOfBoundsException |
Exception for point off map. More... | |
Namespaces | |
namespace | occupancy_grid_utils |