#include <iostream>
#include <fstream>
#include <vector>
#include "ros/ros.h"
#include "geometry_msgs/Twist.h"
#include "geometry_msgs/Pose2D.h"
#include "geometry_msgs/PolygonStamped.h"
#include "sensor_msgs/LaserScan.h"
#include "lama_interfaces/lama_learning_jockey.h"
#include "lama_interfaces/lama_navigating_jockey.h"
#include "lama_interfaces/lmi_laser_descriptor_set.h"
#include "lama_interfaces/lmi_laser_descriptor_get.h"
#include "hist.h"
Go to the source code of this file.
Function Documentation
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
bool navigationCallback |
( |
li::lama_navigating_jockeyRequest & |
request, |
|
|
li::lama_navigating_jockeyResponse & |
response |
|
) |
| |
bool serviceCallback |
( |
li::lama_learning_jockeyRequest & |
request, |
|
|
li::lama_learning_jockeyResponse & |
response |
|
) |
| |
Variable Documentation
sensor_msgs::LaserScan first |
sensor_msgs::LaserScan last |
Large Map Laser based memorybased (learning) navigating jockey
Definition at line 23 of file main.cc.