#include <algorithm>
#include <assert.h>
#include <hector_gazebo_plugins/diffdrive_plugin_6w.h>
#include <gazebo/common/Events.hh>
#include <gazebo/physics/physics.hh>
#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 <boost/bind.hpp>
#include <gazebo/gazebo_config.h>
Go to the source code of this file.
Namespaces | |
gazebo | |
Enumerations | |
enum | { gazebo::FRONT_LEFT, gazebo::FRONT_RIGHT, gazebo::MID_LEFT, gazebo::MID_RIGHT, gazebo::REAR_LEFT, gazebo::REAR_RIGHT, gazebo::NUM_WHEELS } |