Variables | |
contact | |
contactNormal = np.zeros(3) | |
data = robot.data() | |
f = np.zeros(3) | |
filename = str(Path(__file__).resolve().parent) | |
float | fMax = 1000.0 |
float | fMin = 10.0 |
forceGenMat = contact.getForceGeneratorMatrix | |
forceIneq = contact.computeForceTask(t, q, v, data) | |
string | frameName = "RAnkleRoll" |
H_ref = robot.position(data, robot.model().getJointId(frameName)) | |
int | Kd = 2 * Kp |
Kp = np.ones(3) | |
model = robot.model() | |
float | mu = 0.3 |
string | path = filename + "/../../models/romeo" |
q = model.neutralConfiguration | |
robot = tsid.RobotWrapper(urdf, vector, se3.JointModelFreeFlyer(), False) | |
float | t = 0.0 |
int | tol = 1e-5 |
string | urdf = path + "/urdf/romeo.urdf" |
v = np.zeros(robot.nv) | |
vector = se3.StdVec_StdString() | |
test_ContactPoint.contact |
Definition at line 29 of file test_ContactPoint.py.
test_ContactPoint.contactNormal = np.zeros(3) |
Definition at line 26 of file test_ContactPoint.py.
test_ContactPoint.data = robot.data() |
Definition at line 20 of file test_ContactPoint.py.
test_ContactPoint.f = np.zeros(3) |
Definition at line 54 of file test_ContactPoint.py.
Definition at line 12 of file test_ContactPoint.py.
float test_ContactPoint.fMax = 1000.0 |
Definition at line 24 of file test_ContactPoint.py.
float test_ContactPoint.fMin = 10.0 |
Definition at line 23 of file test_ContactPoint.py.
test_ContactPoint.forceGenMat = contact.getForceGeneratorMatrix |
Definition at line 60 of file test_ContactPoint.py.
Definition at line 53 of file test_ContactPoint.py.
string test_ContactPoint.frameName = "RAnkleRoll" |
Definition at line 25 of file test_ContactPoint.py.
test_ContactPoint.H_ref = robot.position(data, robot.model().getJointId(frameName)) |
Definition at line 48 of file test_ContactPoint.py.
int test_ContactPoint.Kd = 2 * Kp |
Definition at line 37 of file test_ContactPoint.py.
test_ContactPoint.Kp = np.ones(3) |
Definition at line 36 of file test_ContactPoint.py.
test_ContactPoint.model = robot.model() |
Definition at line 19 of file test_ContactPoint.py.
float test_ContactPoint.mu = 0.3 |
Definition at line 22 of file test_ContactPoint.py.
string test_ContactPoint.path = filename + "/../../models/romeo" |
Definition at line 14 of file test_ContactPoint.py.
test_ContactPoint.q = model.neutralConfiguration |
Definition at line 44 of file test_ContactPoint.py.
test_ContactPoint.robot = tsid.RobotWrapper(urdf, vector, se3.JointModelFreeFlyer(), False) |
Definition at line 18 of file test_ContactPoint.py.
float test_ContactPoint.t = 0.0 |
Definition at line 51 of file test_ContactPoint.py.
int test_ContactPoint.tol = 1e-5 |
Definition at line 11 of file test_ContactPoint.py.
string test_ContactPoint.urdf = path + "/urdf/romeo.urdf" |
Definition at line 15 of file test_ContactPoint.py.
test_ContactPoint.v = np.zeros(robot.nv) |
Definition at line 45 of file test_ContactPoint.py.
test_ContactPoint.vector = se3.StdVec_StdString() |
Definition at line 16 of file test_ContactPoint.py.