$search
#include <algorithm>#include <assert.h>#include <hector_gazebo_plugins/diffdrive_plugin_6w.h>#include <gazebo/gazebo.h>#include <gazebo/GazeboError.hh>#include <gazebo/Quatern.hh>#include <gazebo/Controller.hh>#include <gazebo/Body.hh>#include <gazebo/World.hh>#include <gazebo/Simulator.hh>#include <gazebo/Global.hh>#include <gazebo/XMLConfig.hh>#include <gazebo/ControllerFactory.hh>#include <gazebo/PhysicsEngine.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>
Go to the source code of this file.
Enumerations | |
| enum | { FRONT_LEFT, FRONT_RIGHT, MID_LEFT, MID_RIGHT, REAR_LEFT, REAR_RIGHT, NUM_WHEELS } |
Functions | |
| GZ_REGISTER_DYNAMIC_CONTROLLER ("diffdrive_plugin_6w", DiffDrivePlugin6W) | |
| anonymous enum |
Definition at line 61 of file diffdrive_plugin_6w.cpp.
| GZ_REGISTER_DYNAMIC_CONTROLLER | ( | "diffdrive_plugin_6w" | , | |
| DiffDrivePlugin6W | ||||
| ) |