24 #ifndef THORMANG3_WALKING_DEMO_THORMANG3_WALKING_DEMO_H_ 25 #define THORMANG3_WALKING_DEMO_THORMANG3_WALKING_DEMO_H_ 29 #include <std_msgs/String.h> 30 #include <yaml-cpp/yaml.h> 32 #include "robotis_controller_msgs/StatusMsg.h" 33 #include "thormang3_walking_module_msgs/RobotPose.h" 34 #include "thormang3_walking_module_msgs/GetReferenceStepData.h" 35 #include "thormang3_walking_module_msgs/AddStepDataArray.h" 36 #include "thormang3_walking_module_msgs/StartWalking.h" 37 #include "thormang3_walking_module_msgs/SetBalanceParam.h" 38 #include "thormang3_walking_module_msgs/SetJointFeedBackGain.h" 39 #include "thormang3_walking_module_msgs/IsRunning.h" 40 #include "thormang3_walking_module_msgs/RemoveExistingStepData.h" 49 bool loadBalanceParam(thormang3_walking_module_msgs::SetBalanceParam& set_param);
50 bool loadFeedBackGain(thormang3_walking_module_msgs::SetJointFeedBackGain& set_gain);
bool loadFeedBackGain(thormang3_walking_module_msgs::SetJointFeedBackGain &set_gain)
bool loadBalanceParam(thormang3_walking_module_msgs::SetBalanceParam &set_param)