#include <nav_msgs/OccupancyGrid.h>#include <tf2_geometry_msgs/tf2_geometry_msgs.h>#include <opencv2/core/utility.hpp>#include <opencv2/imgcodecs.hpp>#include <random>

Go to the source code of this file.
Functions | |
| nav_msgs::OccupancyGridConstPtr | loadMap (const std::string &filename) |
| template<typename InputIt > | |
| std::vector< nav_msgs::OccupancyGridConstPtr > | loadMaps (InputIt filenames_begin, InputIt filenames_end) |
| std::tuple< double, double, double > | randomAngleTxTy () |
| tf2::Transform | randomTransform () |
| cv::Mat | randomTransformMatrix () |
| void | saveMap (const std::string &filename, const nav_msgs::OccupancyGridConstPtr &map) |
Variables | |
| const float | resolution = 0.05f |
| nav_msgs::OccupancyGridConstPtr loadMap | ( | const std::string & | filename | ) |
Definition at line 34 of file testing_helpers.h.
| std::vector<nav_msgs::OccupancyGridConstPtr> loadMaps | ( | InputIt | filenames_begin, |
| InputIt | filenames_end | ||
| ) |
Definition at line 23 of file testing_helpers.h.
| std::tuple< double, double, double > randomAngleTxTy | ( | ) |
Definition at line 78 of file testing_helpers.h.
| tf2::Transform randomTransform | ( | ) |
Definition at line 88 of file testing_helpers.h.
| cv::Mat randomTransformMatrix | ( | ) |
Definition at line 101 of file testing_helpers.h.
| void saveMap | ( | const std::string & | filename, |
| const nav_msgs::OccupancyGridConstPtr & | map | ||
| ) |
Definition at line 58 of file testing_helpers.h.
| const float resolution = 0.05f |
Definition at line 11 of file testing_helpers.h.