#include <uos_freespace.h>
|
void | autonomousBehaviour (const sensor_msgs::LaserScan::ConstPtr &laserscan) |
|
double | calcFreespace (const sensor_msgs::LaserScan::ConstPtr &laserscan) |
|
int | checkRange (const sensor_msgs::LaserScan::ConstPtr &laserscan, double xregion, double yregion, int *indexToObstacle, double *distanceToObstacle) |
|
int | isInvertedScannerCheck (const sensor_msgs::LaserScan::ConstPtr &laserscan) |
|
Definition at line 11 of file uos_freespace.h.
void FreeSpace::autonomousBehaviour |
( |
const sensor_msgs::LaserScan::ConstPtr & |
laserscan | ) |
|
|
private |
double FreeSpace::calcFreespace |
( |
const sensor_msgs::LaserScan::ConstPtr & |
laserscan | ) |
|
|
private |
int FreeSpace::checkRange |
( |
const sensor_msgs::LaserScan::ConstPtr & |
laserscan, |
|
|
double |
xregion, |
|
|
double |
yregion, |
|
|
int * |
indexToObstacle, |
|
|
double * |
distanceToObstacle |
|
) |
| |
|
private |
int FreeSpace::isInvertedScannerCheck |
( |
const sensor_msgs::LaserScan::ConstPtr & |
laserscan | ) |
|
|
private |
double FreeSpace::max_rotational_vel_ |
|
private |
double FreeSpace::max_vel_x_ |
|
private |
int FreeSpace::scanner_orientation_ |
|
private |
std::string FreeSpace::tf_prefix_ |
|
private |
double FreeSpace::turn_omega_ |
|
private |
int FreeSpace::turn_state_ |
|
private |
The documentation for this class was generated from the following files: