#include <stdint.h>
#include <string>
#include <mrpt/version.h>
Go to the source code of this file.
Classes | |
class | mrpt_bridge::MapHdl |
the map class is implemented as singeleton use map::instance ()->ros2mrpt ... More... | |
Namespaces | |
namespace | mrpt |
namespace | mrpt::maps |
namespace | mrpt::utils |
namespace | mrpt_bridge |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
namespace | nav_msgs |
namespace | std |
namespace | std_msgs |
Typedefs | |
typedef Header_ < std::allocator< void > > | std_msgs::Header |
typedef OccupancyGrid_ < std::allocator< void > > | nav_msgs::OccupancyGrid |
Functions | |
Maps, Occupancy Grid Maps: ROS <-> MRPT | |
bool | mrpt_bridge::convert (const nav_msgs::OccupancyGrid &src, COccupancyGridMap2D &des) |
bool | mrpt_bridge::convert (const COccupancyGridMap2D &src, nav_msgs::OccupancyGrid &msg, const std_msgs::Header &header) |
bool | mrpt_bridge::convert (const COccupancyGridMap2D &src, nav_msgs::OccupancyGrid &msg) |