#include <math.h>
#include <vector>
#include <stdio.h>
#include "nlj_laser/hist.h"
#include "geometry_msgs/PolygonStamped.h"
#include "geometry_msgs/Point32.h"
Go to the source code of this file.
Defines |
| #define | SHIFT 1 |
Functions |
| int | crossCorrelationHist (Hist x, Hist y) |
| double | error (sensor_msgs::LaserScan scan, sensor_msgs::LaserScan reference, geometry_msgs::Pose2D goal) |
| double | error (sensor_msgs::LaserScan scan, sensor_msgs::LaserScan reference, geometry_msgs::Pose2D goal, ros::Publisher draw, ros::Publisher drawRef) |
| Hist | hist (sensor_msgs::LaserScan scan, int anglebins) |
| geometry_msgs::Pose2D | localize (sensor_msgs::LaserScan a, sensor_msgs::LaserScan b, int angls) |
Define Documentation
Function Documentation
| double error |
( |
sensor_msgs::LaserScan |
scan, |
|
|
sensor_msgs::LaserScan |
reference, |
|
|
geometry_msgs::Pose2D |
goal |
|
) |
| |
| Hist hist |
( |
sensor_msgs::LaserScan |
scan, |
|
|
int |
anglebins |
|
) |
| |
| geometry_msgs::Pose2D localize |
( |
sensor_msgs::LaserScan |
a, |
|
|
sensor_msgs::LaserScan |
b, |
|
|
int |
angls |
|
) |
| |