#include <ros/ros.h>#include "rtabmap_ros/MapData.h"#include "rtabmap_ros/MsgConversion.h"#include <rtabmap/core/util3d.h>#include <rtabmap/core/Graph.h>#include <rtabmap/core/Compression.h>#include <rtabmap/utilite/ULogger.h>#include <rtabmap/utilite/UStl.h>#include <rtabmap/utilite/UTimer.h>#include <nav_msgs/OccupancyGrid.h>#include <nav_msgs/GetMap.h>#include <std_srvs/Empty.h>#include <pcl_ros/transforms.h>#include <pcl_conversions/pcl_conversions.h>
Go to the source code of this file.
Classes | |
| class | GridMapAssembler |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 192 of file GridMapAssemblerNode.cpp.