#include <stdio.h>#include <ros/ros.h>#include <sensor_msgs/JointState.h>#include <dynamixel_sdk/dynamixel_sdk.h>#include "robotican_hardware_interface/dynamixel_driver.h"#include <ros/package.h>#include "yaml-cpp/yaml.h"
Go to the source code of this file.
Classes | |
| struct | dynamixel_spec |
| struct | motor |
Defines | |
| #define | BAUDRATE 57600 |
| #define | DEVICENAME "/dev/ttyUSB0" |
| #define | PROTOCOL_VERSION 2.0 |
Functions | |
| bool | bulk_read () |
| bool | bulk_write () |
| void | CmdCallback (const sensor_msgs::JointStateConstPtr &msg) |
| int | getch () |
| void | initSpecFile () |
| int | kbhit (void) |
| int | main (int argc, char **argv) |
| bool | ping (struct motor &motor) |
| int32_t | rads2ticks (double rads, struct motor &motor) |
| bool | setTorque (struct motor &motor, bool onoff) |
| double | ticks2rads (int32_t ticks, struct motor &motor) |
Variables | |
| std::map< uint16_t, dynamixel_spec > | _modelSpec |
| struct motor * | motors |
| int | num_motors = 0 |
| dynamixel::PacketHandler * | packetHandler |
| dynamixel::PortHandler * | portHandler |
| #define DEVICENAME "/dev/ttyUSB0" |
| #define PROTOCOL_VERSION 2.0 |
| bool bulk_write | ( | ) |
| void CmdCallback | ( | const sensor_msgs::JointStateConstPtr & | msg | ) |
| void initSpecFile | ( | ) |
| int32_t rads2ticks | ( | double | rads, |
| struct motor & | motor | ||
| ) |
| double ticks2rads | ( | int32_t | ticks, |
| struct motor & | motor | ||
| ) |
| std::map<uint16_t, dynamixel_spec> _modelSpec |
| int num_motors = 0 |