#include <algorithm>
#include <assert.h>
#include <gazebo_plugins/gazebo_ros_skid_steer_drive.h>
#include <gazebo/math/gzmath.hh>
#include <sdf/sdf.hh>
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/GetMap.h>
#include <nav_msgs/Odometry.h>
#include <boost/bind.hpp>
#include <boost/thread/mutex.hpp>
Go to the source code of this file.
Namespaces | |
namespace | gazebo |
Enumerations | |
enum | { gazebo::RIGHT_FRONT = 0, gazebo::LEFT_FRONT = 1, gazebo::RIGHT_REAR = 2, gazebo::LEFT_REAR = 3 } |