Functions
testing_helper.h File Reference
#include <costmap_2d/cost_values.h>
#include <costmap_2d/costmap_2d.h>
#include <costmap_2d/static_layer.h>
#include <costmap_2d/obstacle_layer.h>
#include <costmap_2d/inflation_layer.h>
#include <sensor_msgs/point_cloud2_iterator.h>
Include dependency graph for testing_helper.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Functions

costmap_2d::InflationLayeraddInflationLayer (costmap_2d::LayeredCostmap &layers, tf2_ros::Buffer &tf)
 
void addObservation (costmap_2d::ObstacleLayer *olayer, double x, double y, double z=0.0, double ox=0.0, double oy=0.0, double oz=MAX_Z)
 
costmap_2d::ObstacleLayeraddObstacleLayer (costmap_2d::LayeredCostmap &layers, tf2_ros::Buffer &tf)
 
void addStaticLayer (costmap_2d::LayeredCostmap &layers, tf2_ros::Buffer &tf)
 
unsigned int countValues (costmap_2d::Costmap2D &costmap, unsigned char value, bool equal=true)
 
const double MAX_Z (1.0)
 
char printableCost (unsigned char cost)
 
void printMap (costmap_2d::Costmap2D &costmap)
 
void setValues (costmap_2d::Costmap2D &costmap, const unsigned char *map)
 

Function Documentation

◆ addInflationLayer()

costmap_2d::InflationLayer* addInflationLayer ( costmap_2d::LayeredCostmap layers,
tf2_ros::Buffer tf 
)

Definition at line 99 of file testing_helper.h.

◆ addObservation()

void addObservation ( costmap_2d::ObstacleLayer olayer,
double  x,
double  y,
double  z = 0.0,
double  ox = 0.0,
double  oy = 0.0,
double  oz = MAX_Z 
)

Definition at line 77 of file testing_helper.h.

◆ addObstacleLayer()

costmap_2d::ObstacleLayer* addObstacleLayer ( costmap_2d::LayeredCostmap layers,
tf2_ros::Buffer tf 
)

Definition at line 69 of file testing_helper.h.

◆ addStaticLayer()

void addStaticLayer ( costmap_2d::LayeredCostmap layers,
tf2_ros::Buffer tf 
)

Definition at line 62 of file testing_helper.h.

◆ countValues()

unsigned int countValues ( costmap_2d::Costmap2D costmap,
unsigned char  value,
bool  equal = true 
)

Definition at line 47 of file testing_helper.h.

◆ MAX_Z()

const double MAX_Z ( 1.  0)

◆ printableCost()

char printableCost ( unsigned char  cost)

Definition at line 24 of file testing_helper.h.

◆ printMap()

void printMap ( costmap_2d::Costmap2D costmap)

Definition at line 36 of file testing_helper.h.

◆ setValues()

void setValues ( costmap_2d::Costmap2D costmap,
const unsigned char *  map 
)

Definition at line 14 of file testing_helper.h.



costmap_2d
Author(s): Eitan Marder-Eppstein, David V. Lu!!, Dave Hershberger, contradict@gmail.com
autogenerated on Wed Jun 22 2022 02:07:03