Functions
functions.cpp File Reference
#include "functions.h"
Include dependency graph for functions.cpp:

Go to the source code of this file.

Functions

int gridValue (nav_msgs::OccupancyGrid &mapData, std::vector< float > Xp)
 
std::vector< float > Nearest (std::vector< std::vector< float > > V, std::vector< float > x)
 
float Norm (std::vector< float > x1, std::vector< float > x2)
 
char ObstacleFree (std::vector< float > xnear, std::vector< float > &xnew, nav_msgs::OccupancyGrid mapsub)
 
float sign (float n)
 
std::vector< float > Steer (std::vector< float > x_nearest, std::vector< float > x_rand, float eta)
 

Function Documentation

int gridValue ( nav_msgs::OccupancyGrid &  mapData,
std::vector< float >  Xp 
)

Definition at line 77 of file functions.cpp.

std::vector<float> Nearest ( std::vector< std::vector< float > >  V,
std::vector< float >  x 
)

Definition at line 26 of file functions.cpp.

float Norm ( std::vector< float >  x1,
std::vector< float >  x2 
)

Definition at line 11 of file functions.cpp.

char ObstacleFree ( std::vector< float >  xnear,
std::vector< float > &  xnew,
nav_msgs::OccupancyGrid  mapsub 
)

Definition at line 99 of file functions.cpp.

float sign ( float  n)

Definition at line 18 of file functions.cpp.

std::vector<float> Steer ( std::vector< float >  x_nearest,
std::vector< float >  x_rand,
float  eta 
)

Definition at line 47 of file functions.cpp.



rrt_exploration
Author(s): Hassan Umari
autogenerated on Mon Jun 10 2019 14:57:45