#include <bwi_mapper/structures/point.h>
#include <nav_msgs/MapMetaData.h>
#include <nav_msgs/OccupancyGrid.h>
Go to the source code of this file.
Namespaces | |
namespace | bwi_mapper |
Defines | |
#define | MAP_IDX(sx, i, j) ((sx) * (j) + (i)) |
Functions | |
bool | bwi_mapper::locationsInDirectLineOfSight (const Point2f &pt1, const Point2f &pt2, const nav_msgs::OccupancyGrid map) |
Point2f | bwi_mapper::toGrid (const Point2f &pt, const nav_msgs::MapMetaData &info) |
Point2f | bwi_mapper::toMap (const Point2f &pt, const nav_msgs::MapMetaData &info) |
#define MAP_IDX | ( | sx, | |
i, | |||
j | |||
) | ((sx) * (j) + (i)) |
Definition at line 46 of file map_utils.h.