#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.
|
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 > |
|
|
) |
| |
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 |
|
|
) |
| |
std::vector<float> Steer |
( |
std::vector< float > |
, |
|
|
std::vector< float > |
, |
|
|
float |
|
|
) |
| |