#include "std_msgs/String.h"#include "robotis_controller/robotis_controller.h"#include "rh_p12_rn_base_module/base_module.h"
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
Variables | |
| const int | BAUD_RATE = 2000000 |
| const int | DEFAULT_DXL_ID = 1 |
| const int | DXL_BROADCAST_ID = 254 |
| int | g_baudrate |
| std::string | g_device_name |
| std::string | g_init_file |
| bool | g_is_simulation = false |
| std::string | g_offset_file |
| std::string | g_robot_file |
| const double | PROTOCOL_VERSION = 2.0 |
| const std::string | SUB_CONTROLLER_DEVICE = "/dev/ttyUSB0" |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 44 of file rh_p12_rn_manager.cpp.
| const int BAUD_RATE = 2000000 |
Definition at line 31 of file rh_p12_rn_manager.cpp.
| const int DEFAULT_DXL_ID = 1 |
Definition at line 34 of file rh_p12_rn_manager.cpp.
| const int DXL_BROADCAST_ID = 254 |
Definition at line 33 of file rh_p12_rn_manager.cpp.
| int g_baudrate |
Definition at line 38 of file rh_p12_rn_manager.cpp.
| std::string g_device_name |
Definition at line 42 of file rh_p12_rn_manager.cpp.
| std::string g_init_file |
Definition at line 41 of file rh_p12_rn_manager.cpp.
| bool g_is_simulation = false |
Definition at line 37 of file rh_p12_rn_manager.cpp.
| std::string g_offset_file |
Definition at line 39 of file rh_p12_rn_manager.cpp.
| std::string g_robot_file |
Definition at line 40 of file rh_p12_rn_manager.cpp.
| const double PROTOCOL_VERSION = 2.0 |
Definition at line 32 of file rh_p12_rn_manager.cpp.
| const std::string SUB_CONTROLLER_DEVICE = "/dev/ttyUSB0" |
Definition at line 35 of file rh_p12_rn_manager.cpp.