#include <cstring>
#include <stdexcept>
#include <stdlib.h>
#include <stdio.h>
#include <SDL/SDL_image.h>
#include "map_server/image_loader.h"
#include <tf/tf.h>
Go to the source code of this file.
Namespaces | |
namespace | map_server |
Defines | |
#define | MAP_IDX(sx, i, j) ((sx) * (j) + (i)) |
Functions | |
void | map_server::loadMapFromFile (nav_msgs::GetMap::Response *resp, const char *fname, double res, bool negate, double occ_th, double free_th, double *origin, MapMode mode=TRINARY) |
#define MAP_IDX | ( | sx, | |
i, | |||
j | |||
) | ((sx) * (j) + (i)) |
Definition at line 49 of file image_loader.cpp.