|
| ex_2.amp = np.array([0.0, 0.05, 0.0]) |
|
| ex_2.ax |
|
| ex_2.com_acc = np.empty((3, N)) * nan |
|
| ex_2.com_acc_des = np.empty((3, N)) * nan |
|
| ex_2.com_acc_ref = np.empty((3, N)) * nan |
|
| ex_2.com_pos = np.empty((3, N)) * nan |
|
| ex_2.com_pos_ref = np.empty((3, N)) * nan |
|
| ex_2.com_vel = np.empty((3, N)) * nan |
|
| ex_2.com_vel_ref = np.empty((3, N)) * nan |
|
| ex_2.dv = tsid.formulation.getAccelerations(sol) |
|
| ex_2.f = tsid.formulation.getContactForce(tsid.contactRF.name, sol) |
|
| ex_2.HQPData = tsid.formulation.computeProblemData(t, q, v) |
|
| ex_2.label |
|
| ex_2.leg = ax[i].legend() |
|
| ex_2.N = conf.N_SIMULATION |
|
| ex_2.offset = tsid.robot.com(tsid.formulation.data()) |
|
| ex_2.q |
|
| ex_2.sampleCom = tsid.trajCom.computeNext() |
|
| ex_2.samplePosture = tsid.trajPosture.computeNext() |
|
| ex_2.sol = tsid.solver.solve(HQPData) |
|
float | ex_2.t = 0.0 |
|
| ex_2.tau = tsid.formulation.getActuatorForces(sol) |
|
| ex_2.time = np.arange(0.0, N * conf.dt, conf.dt) |
|
| ex_2.time_spent = time.time() - time_start |
|
| ex_2.time_start = time.time() |
|
| ex_2.tsid = TsidBiped(conf, conf.viewer) |
|
int | ex_2.two_pi_f = 2 * np.pi * np.array([0.0, 0.5, 0.0]) |
|
int | ex_2.two_pi_f_amp = two_pi_f * amp |
|
int | ex_2.two_pi_f_squared_amp = two_pi_f * two_pi_f_amp |
|
| ex_2.v |
|