Defines | Typedefs | Functions
hist.h File Reference
#include "geometry_msgs/Pose2D.h"
#include "sensor_msgs/LaserScan.h"
#include "ros/ros.h"
Include dependency graph for hist.h:
This graph shows which files directly or indirectly include this file:

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

#define ANGLEBIN   100

Definition at line 13 of file hist.h.

#define HISTSIZE   800

Definition at line 15 of file hist.h.

#define HISTSIZEHALF   400

Definition at line 16 of file hist.h.

#define TRANSCOEF   50

Definition at line 14 of file hist.h.


Typedef Documentation

typedef std::vector<int> Hist

Definition at line 6 of file hist.h.


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,
ros::Publisher  draw,
ros::Publisher  drawRef 
)

Definition at line 175 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.

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

Definition at line 9 of file hist.cc.

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

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