functions.h
Go to the documentation of this file.
00001 #ifndef functions_H
00002 #define functions_H
00003 #include "ros/ros.h"
00004 #include <vector>
00005 #include <stdlib.h>
00006 #include <time.h>
00007 #include <math.h>
00008 #include "nav_msgs/OccupancyGrid.h"
00009 #include "geometry_msgs/Point.h"
00010 #include "visualization_msgs/Marker.h"
00011 
00012 // rdm class, for gentaring random flot numbers
00013 class rdm{
00014 int i;
00015 public:
00016 rdm();
00017 float randomize();
00018 };
00019 
00020 
00021 //Norm function prototype
00022 float Norm( std::vector<float> , std::vector<float> );
00023 
00024 //sign function prototype
00025 float sign(float );
00026 
00027 //Nearest function prototype
00028 std::vector<float> Nearest(  std::vector< std::vector<float>  > , std::vector<float> );
00029 
00030 //Steer function prototype
00031 std::vector<float> Steer(  std::vector<float>, std::vector<float>, float );
00032 
00033 //gridValue function prototype
00034 int gridValue(nav_msgs::OccupancyGrid &,std::vector<float>);
00035 
00036 //ObstacleFree function prototype
00037 char ObstacleFree(std::vector<float> , std::vector<float> & , nav_msgs::OccupancyGrid);
00038 #endif


rrt_exploration
Author(s): Hassan Umari
autogenerated on Thu Jun 6 2019 20:54:03