#include <dynamic_reconfigure/server.h>
#include <std_msgs/Float64.h>
#include <robotican_hardware_interface/Device.h>
#include <robotican_hardware_interface/ros_utils.h>
#include <robotican_hardware_interface/RiCBoardManager.h>
#include <robotican_hardware_interface/RiCBoardConfig.h>
#include <robotican_hardware_interface/RiCBoardPotentiometerConfig.h>
Go to the source code of this file.
Classes | |
class | robotican_hardware::CloseLoopMotor |
class | robotican_hardware::CloseLoopMotorWithEncoder |
class | robotican_hardware::CloseLoopMotorWithPotentiometer |
struct | robotican_hardware::CloseMotorParams |
struct | robotican_hardware::CloseMotorWithEncoderParam |
struct | robotican_hardware::CloseMotorWithPotentiometerParam |
class | robotican_hardware::OpenLoopMotor |
class | robotican_hardware::RiCMotor |
Namespaces | |
namespace | robotican_hardware |
Defines | |
#define | MOTOR_EPSILON 0.001 |
#define MOTOR_EPSILON 0.001 |
Definition at line 17 of file RiCMotor.h.