dynamixel_hardware_interface.hpp
Go to the documentation of this file.
1 #ifndef dynamixel_hardware_interface
2 #define dynamixel_hardware_interface
3 
4 // ROS
5 #include <ros/ros.h>
6 
7 // ROS control
11 #include <sensor_msgs/JointState.h>
12 #include <std_msgs/Float64.h>
13 
14 namespace dynamixel {
15 
17  public:
20 
21  void init(ros::NodeHandle nh);
22 
23  void read_joints(sensor_msgs::JointState js);
24  std::vector<double> write_joints();
25 
26  private:
27  // not implemented
29 
30  // not implemented
32 
33  // ROS's hardware interface instances
36 
37  // Memory space shared with the controller
38  // It reads here the latest robot's state and put here the next desired values
39  std::vector<std::string> _joint_names;
40  std::vector<double> _prev_commands;
41  std::vector<double> _joint_commands; // target joint angle
42  std::vector<double> _joint_angles; // actual joint angle
43  std::vector<double> _joint_velocities; // actual joint velocity
44  std::vector<double> _joint_efforts; // compulsory but not used
46  };
47 }
48 
49 #endif
DynamixelHardwareInterface & operator=(DynamixelHardwareInterface const &)
hardware_interface::JointStateInterface _jnt_state_interface
hardware_interface::EffortJointInterface _jnt_effort_interface


svenzva_drivers
Author(s): Max Svetlik
autogenerated on Wed Oct 28 2020 03:31:27