#include <assert.h>
#include <boost/thread.hpp>
#include <boost/lexical_cast.hpp>
#include <libplayercore/playercore.h>
#include <libplayerxdr/playerxdr.h>
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/Range.h>
#include <std_msgs/Float64.h>
#include <erratic_player/BatteryState.h>
#include <erratic_player/RangeArray.h>
Go to the source code of this file.
Define Documentation
Function Documentation
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |