#include "ros/ros.h"
#include <vector>
#include <stdlib.h>
#include <time.h>
#include <math.h>
#include "nav_msgs/OccupancyGrid.h"
#include "geometry_msgs/Point.h"
#include "visualization_msgs/Marker.h"
Go to the source code of this file.
Classes | |
class | rdm |
Functions | |
int | gridValue (nav_msgs::OccupancyGrid &, std::vector< float >) |
std::vector< float > | Nearest (std::vector< std::vector< float > >, std::vector< float >) |
float | Norm (std::vector< float >, std::vector< float >) |
char | ObstacleFree (std::vector< float >, std::vector< float > &, nav_msgs::OccupancyGrid) |
float | sign (float) |
std::vector< float > | Steer (std::vector< float >, std::vector< float >, float) |
int gridValue | ( | nav_msgs::OccupancyGrid & | , |
std::vector< float > | |||
) |
Definition at line 77 of file functions.cpp.
std::vector<float> Nearest | ( | std::vector< std::vector< float > > | , |
std::vector< float > | |||
) |
Definition at line 26 of file functions.cpp.
float Norm | ( | std::vector< float > | , |
std::vector< float > | |||
) |
Definition at line 11 of file functions.cpp.
char ObstacleFree | ( | std::vector< float > | , |
std::vector< float > & | , | ||
nav_msgs::OccupancyGrid | |||
) |
Definition at line 99 of file functions.cpp.
float sign | ( | float | ) |
Definition at line 18 of file functions.cpp.
std::vector<float> Steer | ( | std::vector< float > | , |
std::vector< float > | , | ||
float | |||
) |
Definition at line 47 of file functions.cpp.