#include "geometry_msgs/Pose2D.h"
#include "sensor_msgs/LaserScan.h"
#include "ros/ros.h"
Go to the source code of this file.
Defines |
#define | ANGLEBIN 100 |
#define | HISTSIZE 800 |
#define | HISTSIZEHALF 400 |
#define | TRANSCOEF 50 |
Typedefs |
typedef std::vector< int > | Hist |
Functions |
int | crossCorrelationHist (Hist x, Hist y) |
double | error (sensor_msgs::LaserScan scan, sensor_msgs::LaserScan reference, geometry_msgs::Pose2D goal, ros::Publisher draw, ros::Publisher drawRef) |
double | error (sensor_msgs::LaserScan scan, sensor_msgs::LaserScan reference, geometry_msgs::Pose2D goal) |
Hist | hist (sensor_msgs::LaserScan scan, int bins) |
geometry_msgs::Pose2D | localize (sensor_msgs::LaserScan a, sensor_msgs::LaserScan b, int anglebins) |
Define Documentation
Typedef Documentation
typedef std::vector<int> Hist |
Definition at line 6 of file hist.h.
Function Documentation
double error |
( |
sensor_msgs::LaserScan |
scan, |
|
|
sensor_msgs::LaserScan |
reference, |
|
|
geometry_msgs::Pose2D |
goal |
|
) |
| |
Hist hist |
( |
sensor_msgs::LaserScan |
scan, |
|
|
int |
bins |
|
) |
| |
geometry_msgs::Pose2D localize |
( |
sensor_msgs::LaserScan |
a, |
|
|
sensor_msgs::LaserScan |
b, |
|
|
int |
anglebins |
|
) |
| |