|
| MapServer (const std::string &fname, double res) |
|
Definition at line 60 of file main.cpp.
◆ MapServer()
MapServer::MapServer |
( |
const std::string & |
fname, |
|
|
double |
res |
|
) |
| |
|
inline |
Trivial constructor
Definition at line 64 of file main.cpp.
◆ changeMapCallback()
bool MapServer::changeMapCallback |
( |
nav_msgs::LoadMap::Request & |
request, |
|
|
nav_msgs::LoadMap::Response & |
response |
|
) |
| |
|
inlineprivate |
Callback invoked when someone requests to change the map
Definition at line 123 of file main.cpp.
◆ loadMapFromParams()
bool MapServer::loadMapFromParams |
( |
std::string |
map_file_name, |
|
|
double |
resolution |
|
) |
| |
|
inlineprivate |
Load a map using the deprecated method
Definition at line 173 of file main.cpp.
◆ loadMapFromValues()
bool MapServer::loadMapFromValues |
( |
std::string |
map_file_name, |
|
|
double |
resolution, |
|
|
int |
negate, |
|
|
double |
occ_th, |
|
|
double |
free_th, |
|
|
double |
origin[3], |
|
|
MapMode |
mode |
|
) |
| |
|
inlineprivate |
Load a map given all the values needed to understand it
Definition at line 140 of file main.cpp.
◆ loadMapFromYaml()
bool MapServer::loadMapFromYaml |
( |
std::string |
path_to_yaml | ) |
|
|
inlineprivate |
Load a map given a path to a yaml file
Definition at line 189 of file main.cpp.
◆ mapCallback()
bool MapServer::mapCallback |
( |
nav_msgs::GetMap::Request & |
req, |
|
|
nav_msgs::GetMap::Response & |
res |
|
) |
| |
|
inlineprivate |
Callback invoked when someone requests our service
Definition at line 110 of file main.cpp.
◆ change_map_srv_
◆ deprecated_
bool MapServer::deprecated_ |
|
private |
◆ frame_id_
std::string MapServer::frame_id_ |
|
private |
◆ get_map_service_
◆ map_pub_
◆ map_resp_
nav_msgs::GetMap::Response MapServer::map_resp_ |
|
private |
◆ meta_data_message_
nav_msgs::MapMetaData MapServer::meta_data_message_ |
|
private |
The map data is cached here, to be sent out to service callers
Definition at line 287 of file main.cpp.
◆ metadata_pub_
◆ nh_
The documentation for this class was generated from the following file: