#include <occupancy_grid_utils/file.h>
#include <tf/transform_datatypes.h>
#include <nav_msgs/GetMap.h>
#include <cstring>
#include <stdexcept>
#include <stdlib.h>
#include <stdio.h>
#include <SDL/SDL_image.h>
#include "LinearMath/btMatrix3x3.h"
Go to the source code of this file.
Namespaces | |
namespace | occupancy_grid_utils |
Defines | |
#define | MAP_IDX(sx, i, j) ((sx) * (j) + (i)) |
Functions | |
nm::OccupancyGrid::Ptr | occupancy_grid_utils::loadGrid (const std::string &fname, const double resolution, const gm::Pose &origin_pose) |
void | occupancy_grid_utils::loadMapFromFile (nav_msgs::GetMap::Response *resp, const char *fname, double res, bool negate, double occ_th, double free_th, double *origin) |
Implementation of file ops
Definition in file file.cpp.