Functions | Variables
testing_helpers.h File Reference
#include <nav_msgs/OccupancyGrid.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <opencv2/core/utility.hpp>
#include <opencv2/imgcodecs.hpp>
#include <random>
Include dependency graph for testing_helpers.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Functions

static bool consistentData (const nav_msgs::OccupancyGrid &grid)
 
static bool isIdentity (const geometry_msgs::Transform &transform)
 
static bool isIdentity (const geometry_msgs::Quaternion &rotation)
 
nav_msgs::OccupancyGridConstPtr loadMap (const std::string &filename)
 
template<typename InputIt >
std::vector< nav_msgs::OccupancyGridConstPtr > loadMaps (InputIt filenames_begin, InputIt filenames_end)
 
static bool operator== (const nav_msgs::OccupancyGrid &grid1, const nav_msgs::OccupancyGrid &grid2)
 
std::tuple< double, double, double > randomAngleTxTy ()
 
geometry_msgs::Transform randomTransform ()
 
cv::Mat randomTransformMatrix ()
 
void saveMap (const std::string &filename, const nav_msgs::OccupancyGridConstPtr &map)
 

Variables

const float resolution = 0.05f
 

Function Documentation

◆ consistentData()

static bool consistentData ( const nav_msgs::OccupancyGrid &  grid)
inlinestatic

Definition at line 137 of file testing_helpers.h.

◆ isIdentity() [1/2]

static bool isIdentity ( const geometry_msgs::Transform &  transform)
inlinestatic

Definition at line 122 of file testing_helpers.h.

◆ isIdentity() [2/2]

static bool isIdentity ( const geometry_msgs::Quaternion &  rotation)
inlinestatic

Definition at line 129 of file testing_helpers.h.

◆ loadMap()

nav_msgs::OccupancyGridConstPtr loadMap ( const std::string &  filename)

Definition at line 33 of file testing_helpers.h.

◆ loadMaps()

template<typename InputIt >
std::vector<nav_msgs::OccupancyGridConstPtr> loadMaps ( InputIt  filenames_begin,
InputIt  filenames_end 
)

Definition at line 22 of file testing_helpers.h.

◆ operator==()

static bool operator== ( const nav_msgs::OccupancyGrid &  grid1,
const nav_msgs::OccupancyGrid &  grid2 
)
inlinestatic

Definition at line 143 of file testing_helpers.h.

◆ randomAngleTxTy()

std::tuple< double, double, double > randomAngleTxTy ( )

Definition at line 77 of file testing_helpers.h.

◆ randomTransform()

geometry_msgs::Transform randomTransform ( )

Definition at line 87 of file testing_helpers.h.

◆ randomTransformMatrix()

cv::Mat randomTransformMatrix ( )

Definition at line 111 of file testing_helpers.h.

◆ saveMap()

void saveMap ( const std::string &  filename,
const nav_msgs::OccupancyGridConstPtr &  map 
)

Definition at line 57 of file testing_helpers.h.

Variable Documentation

◆ resolution

const float resolution = 0.05f

Definition at line 10 of file testing_helpers.h.



map_merge
Author(s): Jiri Horner
autogenerated on Mon Feb 28 2022 22:46:02