test_Formulation.py
Go to the documentation of this file.
1 from pathlib import Path
2 
3 import numpy as np
4 import pinocchio as se3
5 import tsid
6 from numpy.linalg import norm
7 
8 print("")
9 print("Test InvDyn")
10 print("")
11 
12 filename = str(Path(__file__).resolve().parent)
13 path = filename + "/../../models/romeo"
14 urdf = path + "/urdf/romeo.urdf"
15 vector = se3.StdVec_StdString()
16 vector.extend(item for item in path)
17 robot = tsid.RobotWrapper(urdf, vector, se3.JointModelFreeFlyer(), False)
18 
19 srdf = path + "/srdf/romeo_collision.srdf"
20 
21 model = robot.model()
22 se3.loadReferenceConfigurations(model, srdf, False)
23 q = model.referenceConfigurations["half_sitting"]
24 
25 q[2] += 0.84
26 v = np.zeros(robot.nv)
27 
28 t = 0.0
29 lxp = 0.14
30 lxn = 0.077
31 lyp = 0.069
32 lyn = 0.069
33 lz = 0.105
34 mu = 0.3
35 fMin = 5.0
36 fMax = 1000.0
37 rf_frame_name = "RAnkleRoll"
38 lf_frame_name = "LAnkleRoll"
39 contactNormal = np.array([0.0, 0.0, 1.0])
40 w_com = 1.0
41 w_posture = 1e-2
42 w_forceRef = 1e-5
43 kp_contact = 100.0
44 kp_com = 30.0
45 kp_posture = 30.0
46 
47 assert robot.model().existFrame(rf_frame_name)
48 assert robot.model().existFrame(lf_frame_name)
49 
50 invdyn = tsid.InverseDynamicsFormulationAccForce("tsid", robot, False)
51 invdyn.computeProblemData(t, q, v)
52 data = invdyn.data()
53 contact_Point = np.ones((3, 4)) * lz
54 contact_Point[0, :] = [-lxn, -lxn, lxp, lxp]
55 contact_Point[1, :] = [-lyn, lyp, -lyn, lyp]
56 
57 contactRF = tsid.Contact6d(
58  "contact_rfoot",
59  robot,
60  rf_frame_name,
61  contact_Point,
62  contactNormal,
63  mu,
64  fMin,
65  fMax,
66  w_forceRef,
67 )
68 contactRF.setKp(kp_contact * np.ones(6))
69 contactRF.setKd(2.0 * np.sqrt(kp_contact) * np.ones(6))
70 H_rf_ref = robot.position(data, robot.model().getJointId(rf_frame_name))
71 contactRF.setReference(H_rf_ref)
72 invdyn.addRigidContact(contactRF)
73 
74 contactLF = tsid.Contact6d(
75  "contact_lfoot",
76  robot,
77  lf_frame_name,
78  contact_Point,
79  contactNormal,
80  mu,
81  fMin,
82  fMax,
83  w_forceRef,
84 )
85 contactLF.setKp(kp_contact * np.ones(6))
86 contactLF.setKd(2.0 * np.sqrt(kp_contact) * np.ones(6))
87 H_lf_ref = robot.position(data, robot.model().getJointId(lf_frame_name))
88 contactLF.setReference(H_lf_ref)
89 invdyn.addRigidContact(contactLF)
90 
91 comTask = tsid.TaskComEquality("task-com", robot)
92 comTask.setKp(kp_com * np.ones(3))
93 comTask.setKd(2.0 * np.sqrt(kp_com) * np.ones(3))
94 invdyn.addMotionTask(comTask, w_com, 1, 0.0)
95 
96 postureTask = tsid.TaskJointPosture("task-posture", robot)
97 postureTask.setKp(kp_posture * np.ones(robot.nv - 6))
98 postureTask.setKd(2.0 * np.sqrt(kp_posture) * np.ones(robot.nv - 6))
99 invdyn.addMotionTask(postureTask, w_posture, 1, 0.0)
100 
101 # ########## Test 1 ##################3
102 dt = 0.01
103 PRINT_N = 100
104 REMOVE_CONTACT_N = 100
105 CONTACT_TRANSITION_TIME = 1.0
106 kp_RF = 100.0
107 w_RF = 1e3
108 max_it = 1000
109 rightFootTask = tsid.TaskSE3Equality("task-right-foot", robot, rf_frame_name)
110 rightFootTask.setKp(kp_RF * np.ones(6))
111 rightFootTask.setKd(2.0 * np.sqrt(kp_com) * np.ones(6))
112 H_rf_ref = robot.position(data, robot.model().getJointId(rf_frame_name))
113 invdyn.addMotionTask(rightFootTask, w_RF, 1, 0.0)
114 
115 s = tsid.TrajectorySample(12, 6)
116 H_rf_ref_vec = np.zeros(12)
117 H_rf_ref_vec[0:3] = H_rf_ref.translation
118 for i in range(0, 3):
119  H_rf_ref_vec[3 * i + 3 : 3 * i + 6] = H_rf_ref.rotation[:, i]
120 s.value(H_rf_ref_vec)
121 rightFootTask.setReference(s)
122 
123 com_ref = robot.com(data)
124 com_ref[1] += 0.1
125 trajCom = tsid.TrajectoryEuclidianConstant("traj_com", com_ref)
126 sampleCom = tsid.TrajectorySample(3)
127 
128 q_ref = q[7:]
129 trajPosture = tsid.TrajectoryEuclidianConstant("traj_joint", q_ref)
130 samplePosture = tsid.TrajectorySample(robot.nv - 6)
131 
132 solver = tsid.SolverHQuadProg("qp solver")
133 solver.resize(invdyn.nVar, invdyn.nEq, invdyn.nIn)
134 
135 tau_old = np.zeros(robot.nv - 6)
136 
137 for i in range(0, max_it):
138  if i == REMOVE_CONTACT_N:
139  print("Start breaking contact right foot")
140  invdyn.removeRigidContact(contactRF.name, CONTACT_TRANSITION_TIME)
141 
142  sampleCom = trajCom.computeNext()
143  comTask.setReference(sampleCom)
144  samplePosture = trajPosture.computeNext()
145  postureTask.setReference(samplePosture)
146 
147  HQPData = invdyn.computeProblemData(t, q, v)
148  if i == 0:
149  HQPData.print_all()
150 
151  sol = solver.solve(HQPData)
152  tau = invdyn.getActuatorForces(sol)
153  dv = invdyn.getAccelerations(sol)
154 
155  if i > 0:
156  # assert norm(tau-tau_old) < 2e1
157  tau_old = tau
158  if i % PRINT_N == 0:
159  print("Time ", i)
160  if invdyn.checkContact(contactRF.name, sol):
161  f = invdyn.getContactForce(contactRF.name, sol)
162  print(" ", contactRF.name, "force: ", contactRF.getNormalForce(f))
163 
164  if invdyn.checkContact(contactLF.name, sol):
165  f = invdyn.getContactForce(contactLF.name, sol)
166  print(" ", contactLF.name, "force: ", contactLF.getNormalForce(f))
167 
168  print(" ", comTask.name, " err:", norm(comTask.position_error, 2))
169  print(" ", "v: ", norm(v, 2), "dv: ", norm(dv))
170 
171  v += dt * dv
172  q = se3.integrate(robot.model(), q, dt * v)
173  t += dt
174 
175  assert norm(dv) < 1e6
176  assert norm(v) < 1e6
177 
178 print("Final COM Position", robot.com(invdyn.data()).transpose())
179 print("Desired COM Position", com_ref.transpose())
tsid::InverseDynamicsFormulationAccForce
Definition: inverse-dynamics-formulation-acc-force.hpp:40


tsid
Author(s): Andrea Del Prete, Justin Carpentier
autogenerated on Thu Apr 3 2025 02:47:16