#include <hardware_interface/joint_state_interface.h>
#include <hardware_interface/joint_command_interface.h>
#include <hardware_interface/force_torque_sensor_interface.h>
#include <hardware_interface/robot_hw.h>
#include <controller_manager/controller_manager.h>
#include <boost/scoped_ptr.hpp>
#include <ros/ros.h>
#include <math.h>
#include "do_output.h"
#include "ur_driver.h"
Go to the source code of this file.
Classes | |
class | ros_control_ur::UrHardwareInterface |
Hardware interface for a robot. More... | |
Namespaces | |
namespace | ros_control_ur |
Variables | |
static const double | ros_control_ur::POSITION_STEP_FACTOR = 1 |
static const double | ros_control_ur::VELOCITY_STEP_FACTOR = 1 |