#include <ros/ros.h>#include <ros/package.h>#include <std_msgs/String.h>#include <yaml-cpp/yaml.h>#include "robotis_controller_msgs/StatusMsg.h"#include "thormang3_walking_module_msgs/RobotPose.h"#include "thormang3_walking_module_msgs/GetReferenceStepData.h"#include "thormang3_walking_module_msgs/AddStepDataArray.h"#include "thormang3_walking_module_msgs/StartWalking.h"#include "thormang3_walking_module_msgs/SetBalanceParam.h"#include "thormang3_walking_module_msgs/SetJointFeedBackGain.h"#include "thormang3_walking_module_msgs/IsRunning.h"#include "thormang3_walking_module_msgs/RemoveExistingStepData.h"

Go to the source code of this file.
Functions | |
| void | initialize () |
| bool | loadBalanceParam (thormang3_walking_module_msgs::SetBalanceParam &set_param) |
| bool | loadFeedBackGain (thormang3_walking_module_msgs::SetJointFeedBackGain &set_gain) |
| void | moveToInitPose () |
| void | setBalanceOff () |
| void | setBalanceOn () |
| void | setCtrlModule () |
| void | walkBackward () |
| void | walkForward () |
| void initialize | ( | ) |
Definition at line 50 of file thormang3_walking_demo.cpp.
| bool loadBalanceParam | ( | thormang3_walking_module_msgs::SetBalanceParam & | set_param | ) |
Definition at line 82 of file thormang3_walking_demo.cpp.
| bool loadFeedBackGain | ( | thormang3_walking_module_msgs::SetJointFeedBackGain & | set_gain | ) |
Definition at line 170 of file thormang3_walking_demo.cpp.
| void moveToInitPose | ( | ) |
Definition at line 67 of file thormang3_walking_demo.cpp.
| void setBalanceOff | ( | ) |
Definition at line 305 of file thormang3_walking_demo.cpp.
| void setBalanceOn | ( | ) |
Definition at line 242 of file thormang3_walking_demo.cpp.
| void setCtrlModule | ( | ) |
Definition at line 75 of file thormang3_walking_demo.cpp.
| void walkBackward | ( | ) |
Definition at line 439 of file thormang3_walking_demo.cpp.
| void walkForward | ( | ) |
Definition at line 357 of file thormang3_walking_demo.cpp.