$search
#include <algorithm>#include <assert.h>#include <reem_controller_plugin/reem_controller_plugin.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>#include <boost/assign/list_of.hpp>
Go to the source code of this file.
Enumerations | |
| enum | { RIGHT, LEFT } |
Functions | |
| GZ_REGISTER_DYNAMIC_CONTROLLER ("reem_controller_plugin", reemControllerPlugin) | |
| anonymous enum |
Definition at line 58 of file reem_controller_plugin.cpp.
| GZ_REGISTER_DYNAMIC_CONTROLLER | ( | "reem_controller_plugin" | , | |
| reemControllerPlugin | ||||
| ) |