#include <string>
#include <vector>
#include <boost/scoped_ptr.hpp>
#include <boost/algorithm/string.hpp>
#include <gazebo/gazebo.hh>
#include <gazebo/common/Plugin.hh>
#include <gazebo/common/Event.hh>
#include <gazebo/physics/Model.hh>
#include <gazebo/physics/Joint.hh>
#include <gazebo/physics/World.hh>
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <sstream>
Go to the source code of this file.
Classes | |
class | uuv_simulator_ros::JointStatePublisher |
Namespaces | |
uuv_simulator_ros | |
A Gazebo ROS plugin for publishing the joint states of a robot (position, velocity and effort). Build similar to the class in the GazeboRosJointStatePublisher, but including more information
Definition in file JointStatePublisher.hh.