#include <bwi_mapper/topological_mapper.h>#include <fstream>#include <yaml-cpp/yaml.h>#include <opencv2/core/core.hpp>#include <opencv2/highgui/highgui.hpp>
Go to the source code of this file.
Functions | |
| void | drawElementsFile (const std::string &elements_file, cv::Mat &image, const Graph &graph, const nav_msgs::MapMetaData &info) |
| int | main (int argc, char **argv) |
| void drawElementsFile | ( | const std::string & | elements_file, |
| cv::Mat & | image, | ||
| const Graph & | graph, | ||
| const nav_msgs::MapMetaData & | info | ||
| ) |
Definition at line 22 of file prepare_graph.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 127 of file prepare_graph.cpp.