Namespaces | Typedefs | Functions | Variables
test_grid_utils.cpp File Reference
#include <iostream>
#include <cmath>
#include <ros/ros.h>
#include <gtest/gtest.h>
#include <occupancy_grid_utils/combine_grids.h>
#include <occupancy_grid_utils/coordinate_conversions.h>
Include dependency graph for test_grid_utils.cpp:

Go to the source code of this file.

Namespaces

namespace  geometry_msgs

Typedefs

typedef boost::shared_ptr
< nav_msgs::OccupancyGrid
const > 
GridConstPtr
typedef boost::shared_ptr
< nav_msgs::OccupancyGrid > 
GridPtr

Functions

bool approxEqual (const double x, const double y)
int main (int argc, char **argv)
geometry_msgs::Point makePoint (const double x, const double y)
geometry_msgs::Pose makePose (const double x, const double y, const double theta)
bool geometry_msgs::operator== (const Polygon &p1, const Polygon &p2)
void setVal (nav_msgs::OccupancyGrid *g, const occupancy_grid_utils::coord_t x, const occupancy_grid_utils::coord_t y, const signed char v)
 TEST (GridUtils, CoordinateConversions)
 TEST (GridUtils, CombineGrids)
int val (const nav_msgs::OccupancyGrid &g, const occupancy_grid_utils::coord_t x, const occupancy_grid_utils::coord_t y)

Variables

const double PI = 3.14159265
const double TOL = 1e-6

Typedef Documentation

typedef boost::shared_ptr<nav_msgs::OccupancyGrid const> GridConstPtr

Definition at line 45 of file test_grid_utils.cpp.

typedef boost::shared_ptr<nav_msgs::OccupancyGrid> GridPtr

Definition at line 44 of file test_grid_utils.cpp.


Function Documentation

bool approxEqual ( const double  x,
const double  y 
)

Definition at line 72 of file test_grid_utils.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 198 of file test_grid_utils.cpp.

geometry_msgs::Point makePoint ( const double  x,
const double  y 
)

Definition at line 84 of file test_grid_utils.cpp.

geometry_msgs::Pose makePose ( const double  x,
const double  y,
const double  theta 
)

Definition at line 92 of file test_grid_utils.cpp.

void setVal ( nav_msgs::OccupancyGrid *  g,
const occupancy_grid_utils::coord_t  x,
const occupancy_grid_utils::coord_t  y,
const signed char  v 
)

Definition at line 101 of file test_grid_utils.cpp.

TEST ( GridUtils  ,
CoordinateConversions   
)

Definition at line 108 of file test_grid_utils.cpp.

TEST ( GridUtils  ,
CombineGrids   
)

Definition at line 140 of file test_grid_utils.cpp.

int val ( const nav_msgs::OccupancyGrid &  g,
const occupancy_grid_utils::coord_t  x,
const occupancy_grid_utils::coord_t  y 
)

Definition at line 77 of file test_grid_utils.cpp.


Variable Documentation

const double PI = 3.14159265

Definition at line 41 of file test_grid_utils.cpp.

const double TOL = 1e-6

Definition at line 42 of file test_grid_utils.cpp.



map_merge
Author(s): Jiri Horner
autogenerated on Sun Mar 26 2017 03:48:10