$search
#include <occupancy_grid_utils/coordinate_conversions.h>
Go to the source code of this file.
Namespaces | |
namespace | occupancy_grid_utils |
Functions | |
geometry_msgs::Polygon | occupancy_grid_utils::cellPolygon (const nav_msgs::MapMetaData &info, const Cell &c) |
Return polygon corresponding to a cell. | |
geometry_msgs::Polygon | occupancy_grid_utils::gridPolygon (const nav_msgs::MapMetaData &info) |
Return polygon corresponding to grid bounds. | |
void | occupancy_grid_utils::verifyDataSize (const nav_msgs::OccupancyGrid &g) |
Verify that data vector has the right size, throw DataSizeException otherwise. |
Implementation for coordinate_conversions.h
Definition in file coordinate_conversions.cpp.