#include <stdio.h>#include <stdlib.h>#include "ros/ros.h"#include "ros/console.h"#include "nav_msgs/MapMetaData.h"#include "nav_msgs/OccupancyGrid.h"#include <boost/thread.hpp>#include <tf/transform_listener.h>#include "nav_msgs/GetMap.h"#include "hector_marker_drawing/HectorDrawings.h"#include "hector_map_tools/HectorMapTools.h"#include "hector_nav_msgs/GetDistanceToObstacle.h"#include "hector_nav_msgs/GetSearchPosition.h"
Go to the source code of this file.
Classes | |
| class | HectorMapServer |
| class | OccupancyGridContainer |
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 320 of file hector_map_server.cpp.