14 #include <nav_msgs/OccupancyGrid.h>    33 #ifdef OCCUPANCY_GRIDMAP_CELL_SIZE_8BITS    52 #ifdef OCCUPANCY_GRIDMAP_CELL_SIZE_8BITS    86         const std::string& _map_file = 
"map.simplemap",
    87         const std::string& _section_name = 
"metricMap", 
bool _debug = 
false);
   107     const std_msgs::Header& 
header);
 static bool loadMap(mrpt::maps::CMultiMetricMap &_metric_map, const mrpt::config::CConfigFileBase &_config_file, const std::string &_map_file="map.simplemap", const std::string &_section_name="metricMap", bool _debug=false)
loads a mprt map 
 
int16_t cellMrpt2Ros(int16_t i)
 
int8_t cellRos2Mrpt(int8_t i)
 
This class allows loading and storing values and vectors of different types from a configuration text...
 
nv_oem6_header_t header
Novatel frame: NV_OEM6_BESTPOS. 
 
static MapHdl * instance()
it creates a instance with some look up table to speed up the conversions 
 
int lut_cellmrpt2ros[0xFFFF]
 
A class for storing an occupancy grid map. 
 
bool toROS(const mrpt::obs::CObservationGPS &obj, const std_msgs::Header &msg_header, sensor_msgs::NavSatFix &msg)
Convert mrpt::obs::CObservationGPS -> sensor_msgs/NavSatFix The user must supply the "msg_header" fie...
 
ROS message: http://docs.ros.org/api/sensor_msgs/html/msg/NavSatFix.html MRPT message: https://github...
 
int lut_cellros2mrpt[101]
 
bool fromROS(const sensor_msgs::NavSatFix &msg, mrpt::obs::CObservationGPS &obj)
Convert sensor_msgs/NavSatFix -> mrpt::obs::CObservationGPS. 
 
#define ASSERT_BELOWEQ_(__A, __B)
 
This class stores any customizable set of metric maps. 
 
Methods to convert between ROS msgs and MRPT objects for map datatypes.