Implements the STDR map server functionalities.
More...
#include <map_server.h>
Implements the STDR map server functionalities.
Definition at line 39 of file map_server.h.
MapServer::MapServer |
( |
const std::string & |
fname | ) |
|
|
explicit |
Constructor by filename.
- Parameters
-
fname | [const std::string&] The file name |
- Returns
- void
Definition at line 31 of file map_server.cpp.
MapServer::MapServer |
( |
const nav_msgs::OccupancyGrid & |
map | ) |
|
|
explicit |
Constructor by occupancy grid map.
- Parameters
-
map | [const nav_msgs::OccupancyGrid&] The occupancy grid map |
- Returns
- void
Definition at line 46 of file map_server.cpp.
void MapServer::publishData |
( |
void |
| ) |
|
|
private |
Publishes the map data and metadata.
- Returns
- void
< Latched publisher for metadata
< Latched publisher for data
Definition at line 60 of file map_server.cpp.
Publishes the map to map_static transform.
- Parameters
-
- Returns
- void
Definition at line 80 of file map_server.cpp.
nav_msgs::OccupancyGrid stdr_server::MapServer::map_ |
|
private |
ROS publisher for posting the map metadata.
Definition at line 77 of file map_server.h.
nav_msgs::MapMetaData stdr_server::MapServer::meta_data_message_ |
|
private |
ROS occupancy grid message.
Definition at line 85 of file map_server.h.
< The ROS node handle
ROS publisher for posting the map
Definition at line 75 of file map_server.h.
The documentation for this class was generated from the following files: