#include "mrpt_bridge/map.h"
#include "mrpt_bridge/pose.h"
#include <nav_msgs/OccupancyGrid.h>
#include <ros/console.h>
#include <mrpt/slam/COccupancyGridMap2D.h>
#include <mrpt/random.h>
#include <mrpt/slam/CMultiMetricMap.h>
#include <mrpt/slam/CSimpleMap.h>
#include <mrpt/utils/CConfigFile.h>
#include <mrpt/utils/CFileGZInputStream.h>
#include <mrpt/system/filesystem.h>
#include <mrpt/system/string_utils.h>
Go to the source code of this file.
Namespaces | |
namespace | mrpt_bridge |
Defines | |
#define | INT16_MAX 0x7fff |
#define | INT16_MIN (-INT16_MAX - 1) |
#define | INT8_MAX 0x7f |
#define | INT8_MIN (-INT8_MAX - 1) |
Functions | |
bool | mrpt_bridge::convert (const nav_msgs::OccupancyGrid &src, mrpt::slam::COccupancyGridMap2D &des) |
bool | mrpt_bridge::convert (const mrpt::slam::COccupancyGridMap2D &src, nav_msgs::OccupancyGrid &msg, const std_msgs::Header &header) |
bool | mrpt_bridge::convert (const mrpt::slam::COccupancyGridMap2D &src, nav_msgs::OccupancyGrid &msg) |