Defines | Functions
hist.cc File Reference
#include <math.h>
#include <vector>
#include <stdio.h>
#include "place_matcher_hist/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   5

Functions

int crossCorrelationHist (Hist x, Hist y)
double error (sensor_msgs::LaserScan scan, sensor_msgs::LaserScan reference, geometry_msgs::Pose2D goal)
Hist hist (const sensor_msgs::LaserScan &scan, int anglebins)
geometry_msgs::Pose2D localize (sensor_msgs::LaserScan a, sensor_msgs::LaserScan b, int rot_bin_count)

Define Documentation

#define SHIFT   5

Definition at line 7 of file hist.cc.


Function Documentation

int crossCorrelationHist ( Hist  x,
Hist  y 
)

Definition at line 46 of file hist.cc.

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

Definition at line 145 of file hist.cc.

Hist hist ( const 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  rot_bin_count 
)

Definition at line 67 of file hist.cc.



place_matcher_hist
Author(s):
autogenerated on Sat Jun 8 2019 19:53:03