Functions
occupancy_grid_file_io Namespace Reference

Functions

bool LoadOccupancyGridDataFromPgmFile (const std::string &map_name, const std::string &map_directory, bool negate, double occupied_threshold, double free_threshold, nav_msgs::OccupancyGrid *occupancy_grid)
bool LoadOccupancyGridFromFiles (const std::string &map_name, const std::string &map_directory, nav_msgs::OccupancyGrid *occupancy_grid, std::string *map_uuid)
bool LoadOccupancyGridMetadataFromYamlFile (const std::string &map_name, const std::string &map_directory, nav_msgs::MapMetaData *map_metadata, int *negate, double *occupied_threshold, double *free_threshold, std::string *map_uuid)
bool SaveOccupancyGridDataToPgmFile (const std::string &map_name, const std::string &map_directory, const nav_msgs::OccupancyGrid &occupancy_grid)
bool SaveOccupancyGridMetadataToYamlFile (const std::string &map_name, const std::string &map_uuid, const std::string &map_directory, const nav_msgs::MapMetaData &map_metadata)
bool SaveOccupancyGridToFiles (const std::string &map_name, const std::string &map_uuid, const std::string &map_directory, const nav_msgs::OccupancyGrid &occupancy_grid)

Function Documentation

bool occupancy_grid_file_io::LoadOccupancyGridDataFromPgmFile ( const std::string &  map_name,
const std::string &  map_directory,
bool  negate,
double  occupied_threshold,
double  free_threshold,
nav_msgs::OccupancyGrid *  occupancy_grid 
)

Definition at line 178 of file occupancy_grid_file_io.cpp.

bool occupancy_grid_file_io::LoadOccupancyGridFromFiles ( const std::string &  map_name,
const std::string &  map_directory,
nav_msgs::OccupancyGrid *  occupancy_grid,
std::string *  map_uuid 
)

Definition at line 164 of file occupancy_grid_file_io.cpp.

bool occupancy_grid_file_io::LoadOccupancyGridMetadataFromYamlFile ( const std::string &  map_name,
const std::string &  map_directory,
nav_msgs::MapMetaData *  map_metadata,
int *  negate,
double *  occupied_threshold,
double *  free_threshold,
std::string *  map_uuid 
)

Definition at line 246 of file occupancy_grid_file_io.cpp.

bool occupancy_grid_file_io::SaveOccupancyGridDataToPgmFile ( const std::string &  map_name,
const std::string &  map_directory,
const nav_msgs::OccupancyGrid &  occupancy_grid 
)

Definition at line 76 of file occupancy_grid_file_io.cpp.

bool occupancy_grid_file_io::SaveOccupancyGridMetadataToYamlFile ( const std::string &  map_name,
const std::string &  map_uuid,
const std::string &  map_directory,
const nav_msgs::MapMetaData &  map_metadata 
)

Definition at line 118 of file occupancy_grid_file_io.cpp.

bool occupancy_grid_file_io::SaveOccupancyGridToFiles ( const std::string &  map_name,
const std::string &  map_uuid,
const std::string &  map_directory,
const nav_msgs::OccupancyGrid &  occupancy_grid 
)

Definition at line 69 of file occupancy_grid_file_io.cpp.



tango_ros_native
Author(s):
autogenerated on Thu Jun 6 2019 19:49:54