19 #include "std_msgs/String.h" 44 int main(
int argc,
char **argv)
46 ros::init(argc, argv,
"rh_p12_rn_manager");
64 if (g_is_simulation ==
true)
67 std::string robot_name;
68 nh.
param<std::string>(
"gazebo_robot_name", robot_name,
"");
73 if (g_robot_file ==
"")
75 ROS_ERROR(
"NO robot file path in the ROS parameters.");
80 if (controller->
initialize(g_robot_file, g_init_file) ==
false)
82 ROS_ERROR(
"ROBOTIS Controller Initialize Fail!");
87 if (g_offset_file !=
"")
std::string g_offset_file
std::string gazebo_robot_name_
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
int main(int argc, char **argv)
void addMotionModule(MotionModule *module)
const std::string SUB_CONTROLLER_DEVICE
bool initialize(const std::string robot_file_path, const std::string init_file_path)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
void loadOffset(const std::string path)
const double PROTOCOL_VERSION
const int DXL_BROADCAST_ID
std::string g_device_name
void setCtrlModule(std::string module_name)