Defines | Functions
hist.cc File Reference
#include <math.h>
#include <vector>
#include <stdio.h>
#include "nlj_laser/hist.h"
#include "geometry_msgs/PolygonStamped.h"
#include "geometry_msgs/Point32.h"
Include dependency graph for hist.cc:

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

#define SHIFT   1

Definition at line 7 of file hist.cc.


Function Documentation

int crossCorrelationHist ( Hist  x,
Hist  y 
)

Definition at line 38 of file hist.cc.

double error ( sensor_msgs::LaserScan  scan,
sensor_msgs::LaserScan  reference,
geometry_msgs::Pose2D  goal 
)

Definition at line 140 of file hist.cc.

double error ( sensor_msgs::LaserScan  scan,
sensor_msgs::LaserScan  reference,
geometry_msgs::Pose2D  goal,
ros::Publisher  draw,
ros::Publisher  drawRef 
)

Definition at line 175 of file hist.cc.

Hist hist ( sensor_msgs::LaserScan  scan,
int  anglebins 
)

Definition at line 9 of file hist.cc.

geometry_msgs::Pose2D localize ( sensor_msgs::LaserScan  a,
sensor_msgs::LaserScan  b,
int  angls 
)

Definition at line 60 of file hist.cc.



nlj_laser
Author(s): Gaël Ecorchard , Karel Košnar
autogenerated on Thu Jun 6 2019 17:50:56