#include <ros/ros.h>
#include <std_msgs/String.h>
#include "robotis_controller/robotis_controller.h"
#include "open_cr_module/open_cr_module.h"
#include "op3_base_module/base_module.h"
#include "op3_head_control_module/head_control_module.h"
#include "op3_action_module/action_module.h"
#include "op3_walking_module/op3_walking_module.h"
#include "op3_direct_control_module/direct_control_module.h"
#include "op3_online_walking_module/online_walking_module.h"
Go to the source code of this file.
Functions | |
void | buttonHandlerCallback (const std_msgs::String::ConstPtr &msg) |
void | dxlTorqueCheckCallback (const std_msgs::String::ConstPtr &msg) |
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 |
ros::Publisher | g_demo_command_pub |
std::string | g_device_name |
std::string | g_init_file |
ros::Publisher | g_init_pose_pub |
bool | g_is_simulation = false |
std::string | g_offset_file |
std::string | g_robot_file |
const int | POWER_CTRL_TABLE = 24 |
const double | PROTOCOL_VERSION = 2.0 |
const int | RGB_LED_CTRL_TABLE = 26 |
const std::string | SUB_CONTROLLER_DEVICE = "/dev/ttyUSB0" |
const int | SUB_CONTROLLER_ID = 200 |
const int | TORQUE_ON_CTRL_TABLE = 64 |
void buttonHandlerCallback | ( | const std_msgs::String::ConstPtr & | msg | ) |
Definition at line 61 of file op3_manager.cpp.
void dxlTorqueCheckCallback | ( | const std_msgs::String::ConstPtr & | msg | ) |
Definition at line 110 of file op3_manager.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 142 of file op3_manager.cpp.
const int BAUD_RATE = 2000000 |
Definition at line 41 of file op3_manager.cpp.
const int DEFAULT_DXL_ID = 1 |
Definition at line 45 of file op3_manager.cpp.
const int DXL_BROADCAST_ID = 254 |
Definition at line 44 of file op3_manager.cpp.
int g_baudrate |
Definition at line 52 of file op3_manager.cpp.
ros::Publisher g_demo_command_pub |
Definition at line 59 of file op3_manager.cpp.
std::string g_device_name |
Definition at line 56 of file op3_manager.cpp.
std::string g_init_file |
Definition at line 55 of file op3_manager.cpp.
ros::Publisher g_init_pose_pub |
Definition at line 58 of file op3_manager.cpp.
bool g_is_simulation = false |
Definition at line 51 of file op3_manager.cpp.
std::string g_offset_file |
Definition at line 53 of file op3_manager.cpp.
std::string g_robot_file |
Definition at line 54 of file op3_manager.cpp.
const int POWER_CTRL_TABLE = 24 |
Definition at line 47 of file op3_manager.cpp.
const double PROTOCOL_VERSION = 2.0 |
Definition at line 42 of file op3_manager.cpp.
const int RGB_LED_CTRL_TABLE = 26 |
Definition at line 48 of file op3_manager.cpp.
const std::string SUB_CONTROLLER_DEVICE = "/dev/ttyUSB0" |
Definition at line 46 of file op3_manager.cpp.
const int SUB_CONTROLLER_ID = 200 |
Definition at line 43 of file op3_manager.cpp.
const int TORQUE_ON_CTRL_TABLE = 64 |
Definition at line 49 of file op3_manager.cpp.