A_ | WalkingControl | protected |
b_ | WalkingControl | protected |
body_trajectory_ | WalkingControl | protected |
c_ | WalkingControl | protected |
calcFootStepParam() | WalkingControl | |
calcFootStepPose(double time, int step) | WalkingControl | |
calcFootTrajectory(int step) | WalkingControl | |
calcGoalFootPose() | WalkingControl | |
calcPreviewControl(double time, int step) | WalkingControl | |
calcPreviewParam(std::vector< double_t > K, int K_row, int K_col, std::vector< double_t > P, int P_row, int P_col) | WalkingControl | |
calcRefZMP(int step) | WalkingControl | |
calcRefZMPx(int step) | WalkingControl | |
calcRefZMPy(int step) | WalkingControl | |
control_cycle_ | WalkingControl | protected |
des_body_accel_ | WalkingControl | protected |
des_body_pos_ | WalkingControl | protected |
des_body_Q_ | WalkingControl | protected |
des_body_vel_ | WalkingControl | protected |
des_l_foot_accel_ | WalkingControl | protected |
des_l_foot_pos_ | WalkingControl | protected |
des_l_foot_Q_ | WalkingControl | protected |
des_l_foot_vel_ | WalkingControl | protected |
des_r_foot_accel_ | WalkingControl | protected |
des_r_foot_pos_ | WalkingControl | protected |
des_r_foot_Q_ | WalkingControl | protected |
des_r_foot_vel_ | WalkingControl | protected |
dsp_ratio_ | WalkingControl | protected |
f_ | WalkingControl | protected |
fin_time_ | WalkingControl | protected |
finalize() | WalkingControl | |
foot_origin_shift_x_ | WalkingControl | protected |
foot_origin_shift_y_ | WalkingControl | protected |
foot_size_x_ | WalkingControl | protected |
foot_size_y_ | WalkingControl | protected |
foot_step_2d_ | WalkingControl | protected |
foot_step_command_ | WalkingControl | protected |
foot_step_param_ | WalkingControl | protected |
foot_step_size_ | WalkingControl | protected |
foot_tra_max_z_ | WalkingControl | protected |
getLIPM(std::vector< double_t > &x_lipm, std::vector< double_t > &y_lipm) | WalkingControl | |
getLipmHeight() | WalkingControl | |
getWalkingAccleration(std::vector< double_t > &l_foot_accel, std::vector< double_t > &r_foot_accel, std::vector< double_t > &body_accel) | WalkingControl | |
getWalkingOrientation(std::vector< double_t > &l_foot_Q, std::vector< double_t > &r_foot_Q, std::vector< double_t > &body_Q) | WalkingControl | |
getWalkingPosition(std::vector< double_t > &l_foot_pos, std::vector< double_t > &r_foot_pos, std::vector< double_t > &body_pos) | WalkingControl | |
getWalkingState(int &walking_leg, int &walking_phase) | WalkingControl | |
getWalkingVelocity(std::vector< double_t > &l_foot_vel, std::vector< double_t > &r_foot_vel, std::vector< double_t > &body_vel) | WalkingControl | |
goal_body_accel_ | WalkingControl | protected |
goal_body_pos_ | WalkingControl | protected |
goal_body_Q_ | WalkingControl | protected |
goal_body_vel_ | WalkingControl | protected |
goal_l_foot_accel_ | WalkingControl | protected |
goal_l_foot_pos_ | WalkingControl | protected |
goal_l_foot_pos_buffer_ | WalkingControl | protected |
goal_l_foot_Q_ | WalkingControl | protected |
goal_l_foot_vel_ | WalkingControl | protected |
goal_r_foot_accel_ | WalkingControl | protected |
goal_r_foot_pos_ | WalkingControl | protected |
goal_r_foot_pos_buffer_ | WalkingControl | protected |
goal_r_foot_Q_ | WalkingControl | protected |
goal_r_foot_vel_ | WalkingControl | protected |
init_body_accel_ | WalkingControl | protected |
init_body_pos_ | WalkingControl | protected |
init_body_Q_ | WalkingControl | protected |
init_body_vel_ | WalkingControl | protected |
init_body_yaw_angle_ | WalkingControl | protected |
init_l_foot_accel_ | WalkingControl | protected |
init_l_foot_pos_ | WalkingControl | protected |
init_l_foot_Q_ | WalkingControl | protected |
init_l_foot_vel_ | WalkingControl | protected |
init_r_foot_accel_ | WalkingControl | protected |
init_r_foot_pos_ | WalkingControl | protected |
init_r_foot_Q_ | WalkingControl | protected |
init_r_foot_vel_ | WalkingControl | protected |
init_time_ | WalkingControl | protected |
initialize(op3_online_walking_module_msgs::FootStepCommand foot_step_command, std::vector< double_t > init_body_pos, std::vector< double_t > init_body_Q, std::vector< double_t > init_r_foot_pos, std::vector< double_t > init_r_foot_Q, std::vector< double_t > init_l_foot_pos, std::vector< double_t > init_l_foot_Q) | WalkingControl | |
initialize(op3_online_walking_module_msgs::Step2DArray foot_step_2d, std::vector< double_t > init_body_pos, std::vector< double_t > init_body_Q, std::vector< double_t > init_r_foot_pos, std::vector< double_t > init_r_foot_Q, std::vector< double_t > init_l_foot_pos, std::vector< double_t > init_l_foot_Q) | WalkingControl | |
K_ | WalkingControl | protected |
k_s_ | WalkingControl | protected |
k_x_ | WalkingControl | protected |
l_foot_tra_ | WalkingControl | protected |
lipm_height_ | WalkingControl | protected |
next() | WalkingControl | |
P_ | WalkingControl | protected |
preview_control_ | WalkingControl | protected |
preview_response_ | WalkingControl | protected |
preview_size_ | WalkingControl | protected |
preview_sum_zmp_x_ | WalkingControl | protected |
preview_sum_zmp_y_ | WalkingControl | protected |
preview_time_ | WalkingControl | protected |
r_foot_tra_ | WalkingControl | protected |
ref_zmp_buffer_ | WalkingControl | protected |
ref_zmp_x_ | WalkingControl | protected |
ref_zmp_y_ | WalkingControl | protected |
set(double time, int step, bool foot_step_2d) | WalkingControl | |
sum_of_cx_ | WalkingControl | protected |
sum_of_cy_ | WalkingControl | protected |
sum_of_zmp_x_ | WalkingControl | protected |
sum_of_zmp_y_ | WalkingControl | protected |
transformFootStep2D() | WalkingControl | |
u_x_ | WalkingControl | protected |
u_y_ | WalkingControl | protected |
walking_leg_ | WalkingControl | protected |
walking_phase_ | WalkingControl | protected |
WalkingControl(double control_cycle, double dsp_ratio, double lipm_height, double foot_height_max, double zmp_offset_x, double zmp_offset_y, std::vector< double_t > x_lipm, std::vector< double_t > y_lipm, double foot_distance) | WalkingControl | |
x_lipm_ | WalkingControl | protected |
y_lipm_ | WalkingControl | protected |
zmp_offset_x_ | WalkingControl | protected |
zmp_offset_y_ | WalkingControl | protected |
~WalkingControl() | WalkingControl | virtual |