$search
#include <nav_msgs/OccupancyGrid.h>

Go to the source code of this file.
Namespaces | |
| namespace | occupancy_grid_utils |
Functions | |
| nav_msgs::OccupancyGrid::Ptr | occupancy_grid_utils::combineGrids (const std::vector< nav_msgs::OccupancyGrid::ConstPtr > &grids) |
| Version of combineGrids that uses the resolution of the first grid. | |
| nav_msgs::OccupancyGrid::Ptr | occupancy_grid_utils::combineGrids (const std::vector< nav_msgs::OccupancyGrid::ConstPtr > &grids, double resolution) |
| Combines a set of grids. | |
Combining overlapping grids
Definition in file combine_grids.h.