#include <ros/ros.h>#include <vector>#include <Eigen/Eigen>#include <ndt_map/ndt_map.h>#include <ndt_map/ndt_cell.h>#include <ndt_map/NDTMapMsg.h>#include <ndt_map/NDTCellMsg.h>#include <nav_msgs/OccupancyGrid.h>#include <string>

Go to the source code of this file.
Namespaces | |
| namespace | lslgeneric |
Functions | |
| bool | lslgeneric::fromMessage (LazyGrid *&idx, NDTMap *&map, ndt_map::NDTMapMsg msg, std::string &frame_name) |
| from message to NDTMap object | |
| bool | lslgeneric::toMessage (NDTMap *map, ndt_map::NDTMapMsg &msg, std::string frame_name) |
| Message building fucntion. | |
| bool | lslgeneric::toOccupancyGrid (NDTMap *ndt_map, nav_msgs::OccupancyGrid &occ_grid, double resolution, std::string frame_id) |
| builds ocuupancy grid message | |