Go to the documentation of this file.
44 #include <sensor_msgs/LaserScan.h>
void rayTrace(GridMap &grid, int x0, int y0, int x1, int y1) const
Bresenham's line algorithm on occupancy map.
void updateCell(GridMap &grid, int x, int y, double log) const
Update grid cell probability of occupancy.
void lineHigh(GridMap &grid, int x0, int y0, int x1, int y1) const
Bresenham's algorithm for drawing lines upward.
void lineLow(GridMap &grid, int x0, int y0, int x1, int y1) const
Bresenham's algorithm for drawing lines downward.
bool updateMap(GridMap &grid, const sensor_msgs::LaserScan::ConstPtr &scan, const vec &pose)
Update the occupancy grid map.
void lineDiag(GridMap &grid, int x0, int y0, int x1, int y1) const
Bresenham's algorithm for drawing lines at +/- 45 deg.
2D grid represented in row major order
OccupancyMapper(const mat &Tbs)
Constructor.