2D grid represented in row major order More...
#include <iosfwd>
#include <cmath>
#include <vector>
#include <geometry_msgs/Pose.h>
#include <nav_msgs/OccupancyGrid.h>
Go to the source code of this file.
Classes | |
class | ergodic_exploration::GridMap |
Constructs an 2D grid. More... | |
Namespaces | |
ergodic_exploration | |
Typedefs | |
typedef std::vector< int8_t > | ergodic_exploration::GridData |
Occupancy grid data. More... | |
Functions | |
unsigned int | ergodic_exploration::axis_length (double lower, double upper, double resolution) |
Length of a grid axis. More... | |
double | ergodic_exploration::axis_upper (double lower, double resolution, unsigned int size) |
Upper axis limit. More... | |