#include <cstddef>#include <nav_msgs/OccupancyGrid.h>

Go to the source code of this file.
Namespaces | |
| namespace | map_ray_caster |
Functions | |
| size_t | map_ray_caster::colFromOffset (const size_t offset, const size_t ncol) |
| void | map_ray_caster::indexToReal (const nav_msgs::OccupancyGrid &map, const size_t index, geometry_msgs::Point32 &point) |
| size_t | map_ray_caster::offsetFromRowCol (const size_t row, const size_t col, const size_t ncol) |
| bool | map_ray_caster::pointInMap (const int row, const int col, const size_t nrow, const size_t ncol) |
| size_t | map_ray_caster::rowFromOffset (const size_t offset, const size_t ncol) |