#include <ros/ros.h>#include <ros/package.h>#include <std_msgs/Bool.h>#include <std_msgs/String.h>#include "thormang3_foot_step_generator/FootStepCommand.h"#include "thormang3_foot_step_generator/Step2DArray.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/IsRunning.h"#include "thormang3_walking_module_msgs/RemoveExistingStepData.h"#include "robotis_foot_step_generator.h"

Go to the source code of this file.
Functions | |
| void | initialize (void) |
| bool | isRunning (void) |
| void | step2DArrayCallback (const thormang3_foot_step_generator::Step2DArray::ConstPtr &msg) |
| void | walkingCommandCallback (const thormang3_foot_step_generator::FootStepCommand::ConstPtr &msg) |
| void | walkingModuleStatusMSGCallback (const robotis_controller_msgs::StatusMsg::ConstPtr &msg) |
| void initialize | ( | void | ) |
Definition at line 63 of file message_callback.cpp.
| bool isRunning | ( | void | ) |
Definition at line 382 of file message_callback.cpp.
| void step2DArrayCallback | ( | const thormang3_foot_step_generator::Step2DArray::ConstPtr & | msg | ) |
Definition at line 327 of file message_callback.cpp.
| void walkingCommandCallback | ( | const thormang3_foot_step_generator::FootStepCommand::ConstPtr & | msg | ) |
Definition at line 94 of file message_callback.cpp.
| void walkingModuleStatusMSGCallback | ( | const robotis_controller_msgs::StatusMsg::ConstPtr & | msg | ) |
Definition at line 80 of file message_callback.cpp.