test/gjk.cpp
Go to the documentation of this file.
1 /*
2  * Software License Agreement (BSD License)
3  *
4  * Copyright (c) 2018, CNRS-LAAS.
5  * All rights reserved.
6  *
7  * Redistribution and use in source and binary forms, with or without
8  * modification, are permitted provided that the following conditions
9  * are met:
10  *
11  * * Redistributions of source code must retain the above copyright
12  * notice, this list of conditions and the following disclaimer.
13  * * Redistributions in binary form must reproduce the above
14  * copyright notice, this list of conditions and the following
15  * disclaimer in the documentation and/or other materials provided
16  * with the distribution.
17  * * Neither the name of Willow Garage, Inc. nor the names of its
18  * contributors may be used to endorse or promote products derived
19  * from this software without specific prior written permission.
20  *
21  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
22  * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
23  * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
24  * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
25  * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
26  * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
27  * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
28  * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
29  * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
30  * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
31  * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
32  * POSSIBILITY OF SUCH DAMAGE.
33  */
34 
37 #define BOOST_TEST_MODULE FCL_GJK
38 #include <time.h>
39 #include <boost/test/included/unit_test.hpp>
40 
41 #include <Eigen/Geometry>
44 #include <hpp/fcl/internal/tools.h>
45 
46 #include "utility.h"
47 
48 using hpp::fcl::FCL_REAL;
51 using hpp::fcl::Matrix3f;
55 using hpp::fcl::Vec3f;
56 
57 typedef Eigen::Matrix<FCL_REAL, Eigen::Dynamic, 1> vector_t;
58 typedef Eigen::Matrix<FCL_REAL, 6, 1> vector6_t;
59 typedef Eigen::Matrix<FCL_REAL, 4, 1> vector4_t;
60 typedef Eigen::Matrix<FCL_REAL, Eigen::Dynamic, Eigen::Dynamic> matrix_t;
61 
62 struct Result {
63  bool collision;
64  clock_t timeGjk;
65  clock_t timeGte;
66 }; // struct benchmark
67 
68 typedef std::vector<Result> Results_t;
69 
71  bool enable_gjk_nesterov_acceleration) {
72  Eigen::IOFormat numpy(Eigen::FullPrecision, Eigen::DontAlignCols, ", ", ", ",
73  "np.array ((", "))", "", "");
74  Eigen::IOFormat tuple(Eigen::FullPrecision, Eigen::DontAlignCols, "", ", ",
75  "", "", "(", ")");
76  std::size_t N = 10000;
77  GJKSolver solver;
78  if (enable_gjk_nesterov_acceleration)
81  Vec3f p1, p2, a1, a2;
82  Matrix3f M;
83  FCL_REAL distance(sqrt(-1));
84  clock_t start, end;
85 
86  std::size_t nCol = 0, nDiff = 0;
87  FCL_REAL eps = 1e-7;
88  Results_t results(N);
89  for (std::size_t i = 0; i < N; ++i) {
90  Vec3f P1_loc(Vec3f::Random()), P2_loc(Vec3f::Random()),
91  P3_loc(Vec3f::Random());
92  Vec3f Q1_loc(Vec3f::Random()), Q2_loc(Vec3f::Random()),
93  Q3_loc(Vec3f::Random());
94  if (i == 0) {
95  P1_loc = Vec3f(0.063996093749999997, -0.15320971679687501,
96  -0.42799999999999999);
97  P2_loc =
98  Vec3f(0.069105957031249998, -0.150722900390625, -0.42999999999999999);
99  P3_loc = Vec3f(0.063996093749999997, -0.15320971679687501,
100  -0.42999999999999999);
101  Q1_loc =
102  Vec3f(-25.655000000000001, -1.2858199462890625, 3.7249809570312502);
103  Q2_loc = Vec3f(-10.926, -1.284259033203125, 3.7281499023437501);
104  Q3_loc = Vec3f(-10.926, -1.2866180419921875, 3.72335400390625);
105  Transform3f tf(
106  Quaternion3f(-0.42437287410898855, -0.26862477561450587,
107  -0.46249645019513175, 0.73064726592483387),
108  Vec3f(-12.824601270753471, -1.6840516940066426, 3.8914453043793844));
109  tf1 = tf;
110  } else if (i == 1) {
111  P1_loc =
112  Vec3f(-0.8027043342590332, -0.30276307463645935, -0.4372950792312622);
113  P2_loc =
114  Vec3f(-0.8027043342590332, 0.30276307463645935, -0.4372950792312622);
115  P3_loc =
116  Vec3f(0.8027043342590332, 0.30276307463645935, -0.4372950792312622);
117  Q1_loc =
118  Vec3f(-0.224713996052742, -0.7417119741439819, 0.19999997317790985);
119  Q2_loc =
120  Vec3f(-0.5247139930725098, -0.7417119741439819, 0.19999997317790985);
121  Q3_loc =
122  Vec3f(-0.224713996052742, -0.7417119741439819, 0.09999997168779373);
123  Matrix3f R;
124  Vec3f T;
125  R << 0.9657787025454787, 0.09400415350535746, 0.24173273843919627,
126  -0.06713698817647556, 0.9908494114820345, -0.11709000206805695,
127  -0.25052768814676646, 0.09685382227587608, 0.9632524147814993;
128 
129  T << -0.13491177905469953, -1, 0.6000449621843792;
130  tf1.setRotation(R);
131  tf1.setTranslation(T);
132  } else {
133  tf1 = Transform3f();
134  }
135 
136  TriangleP tri1(P1_loc, P2_loc, P3_loc);
137  TriangleP tri2(Q1_loc, Q2_loc, Q3_loc);
138  Vec3f normal;
139 
140  bool res;
141  start = clock();
142  res = solver.shapeDistance(tri1, tf1, tri2, tf2, distance, p1, p2, normal);
143  end = clock();
144  results[i].timeGjk = end - start;
145  results[i].collision = !res;
146  assert(res == (distance > 0));
147  if (!res) {
148  Vec3f c1, c2, normal2;
149  ++nCol;
150  // check that moving triangle 2 by the penetration depth in the
151  // direction of the normal makes the triangles collision free.
152  FCL_REAL penetration_depth(-distance);
153  assert(penetration_depth >= 0);
154  tf2.setTranslation((penetration_depth + 10 - 4) * normal);
155  res =
156  solver.shapeDistance(tri1, tf1, tri2, tf2, distance, c1, c2, normal2);
157  if (!res) {
158  std::cerr << "P1 = " << P1_loc.format(tuple) << std::endl;
159  std::cerr << "P2 = " << P2_loc.format(tuple) << std::endl;
160  std::cerr << "P3 = " << P3_loc.format(tuple) << std::endl;
161  std::cerr << "Q1 = " << Q1_loc.format(tuple) << std::endl;
162  std::cerr << "Q2 = " << Q2_loc.format(tuple) << std::endl;
163  std::cerr << "Q3 = " << Q3_loc.format(tuple) << std::endl;
164  std::cerr << "p1 = " << c1.format(tuple) << std::endl;
165  std::cerr << "p2 = " << c2.format(tuple) << std::endl;
166  std::cerr << "tf1 = " << tf1.getTranslation().format(tuple) << " + "
167  << tf1.getQuatRotation().coeffs().format(tuple) << std::endl;
168  std::cerr << "tf2 = " << tf2.getTranslation().format(tuple) << " + "
169  << tf2.getQuatRotation().coeffs().format(tuple) << std::endl;
170  std::cerr << "normal = " << normal.format(tuple) << std::endl;
171  abort();
172  }
173  distance = 0;
174  tf2.setIdentity();
175  }
176  // Compute vectors between vertices
177  Vec3f P1(tf1.transform(P1_loc)), P2(tf1.transform(P2_loc)),
178  P3(tf1.transform(P3_loc)), Q1(tf2.transform(Q1_loc)),
179  Q2(tf2.transform(Q2_loc)), Q3(tf2.transform(Q3_loc));
180  Vec3f u1(P2 - P1);
181  Vec3f v1(P3 - P1);
182  Vec3f w1(u1.cross(v1));
183  Vec3f u2(Q2 - Q1);
184  Vec3f v2(Q3 - Q1);
185  Vec3f w2(u2.cross(v2));
186  BOOST_CHECK(w1.squaredNorm() > eps * eps);
187  M.col(0) = u1;
188  M.col(1) = v1;
189  M.col(2) = w1;
190  // Compute a1 such that p1 = P1 + a11 u1 + a12 v1 + a13 u1 x v1
191  a1 = M.inverse() * (p1 - P1);
192  EIGEN_VECTOR_IS_APPROX(p1, P1 + a1[0] * u1 + a1[1] * v1, eps);
193  BOOST_CHECK(w2.squaredNorm() > eps * eps);
194  // Compute a2 such that p2 = Q1 + a21 u2 + a22 v2 + a23 u2 x v2
195  M.col(0) = u2;
196  M.col(1) = v2;
197  M.col(2) = w2;
198  a2 = M.inverse() * (p2 - Q1);
199  EIGEN_VECTOR_IS_APPROX(p2, Q1 + a2[0] * u2 + a2[1] * v2, eps);
200 
201  // minimal distance and closest points can be considered as a constrained
202  // optimisation problem:
203  //
204  // min f (a1[0],a1[1], a2[0],a2[1])
205  // g1 (a1[0],a1[1], a2[0],a2[1]) <=0
206  // ...
207  // g6 (a1[0],a1[1], a2[0],a2[1]) <=0
208  // with
209  // f (a1[0],a1[1], a2[0],a2[1]) =
210  // 1 2
211  // --- dist (P1 + a1[0] u1 + a1[1] v1, Q1 + a2[0] u2 + a2[1] v2),
212  // 2
213  // g1 (a1[0],a1[1], a2[0],a2[1]) = -a1[0]
214  // g2 (a1[0],a1[1], a2[0],a2[1]) = -a1[1]
215  // g3 (a1[0],a1[1], a2[0],a2[1]) = a1[0] + a1[1] - 1
216  // g4 (a1[0],a1[1], a2[0],a2[1]) = -a2[0]
217  // g5 (a1[0],a1[1], a2[0],a2[1]) = -a2[1]
218  // g6 (a1[0],a1[1], a2[0],a2[1]) = a2[0] + a2[1] - 1
219 
220  // Compute gradient of f
221  vector4_t grad_f;
222  grad_f[0] = -(p2 - p1).dot(u1);
223  grad_f[1] = -(p2 - p1).dot(v1);
224  grad_f[2] = (p2 - p1).dot(u2);
225  grad_f[3] = (p2 - p1).dot(v2);
226  vector6_t g;
227  g[0] = -a1[0];
228  g[1] = -a1[1];
229  g[2] = a1[0] + a1[1] - 1;
230  g[3] = -a2[0];
231  g[4] = -a2[1];
232  g[5] = a2[0] + a2[1] - 1;
233  matrix_t grad_g(4, 6);
234  grad_g.setZero();
235  grad_g(0, 0) = -1.;
236  grad_g(1, 1) = -1;
237  grad_g(0, 2) = 1;
238  grad_g(1, 2) = 1;
239  grad_g(2, 3) = -1;
240  grad_g(3, 4) = -1;
241  grad_g(2, 5) = 1;
242  grad_g(3, 5) = 1;
243  // Check that closest points are on triangles planes
244  // Projection of [P1p1] on line normal to triangle 1 plane is equal to 0
245  BOOST_CHECK_SMALL(a1[2], eps);
246  // Projection of [Q1p2] on line normal to triangle 2 plane is equal to 0
247  BOOST_CHECK_SMALL(a2[2], eps);
248 
249  /* Check Karush–Kuhn–Tucker conditions
250  6
251  __
252  \
253  -grad f = /_ c grad g
254  i=1 i i
255 
256  where c >= 0, and
257  i
258  c g = 0 for i between 1 and 6
259  i i
260  */
261 
262  matrix_t Mkkt(4, 6);
263  matrix_t::Index col = 0;
264  // Check that constraints are satisfied
265  for (vector6_t::Index j = 0; j < 6; ++j) {
266  BOOST_CHECK(g[j] <= eps);
267  // if constraint is saturated, add gradient in matrix
268  if (fabs(g[j]) <= eps) {
269  Mkkt.col(col) = grad_g.col(j);
270  ++col;
271  }
272  }
273  if (col > 0) {
274  Mkkt.conservativeResize(4, col);
275  // Compute KKT coefficients ci by inverting
276  // Mkkt.c = -grad_f
277  Eigen::JacobiSVD<matrix_t> svd(Mkkt,
278  Eigen::ComputeThinU | Eigen::ComputeThinV);
279  vector_t c(svd.solve(-grad_f));
280  for (vector_t::Index j = 0; j < c.size(); ++j) {
281  BOOST_CHECK_MESSAGE(c[j] >= -eps,
282  "c[" << j << "]{" << c[j] << "} is below " << -eps);
283  }
284  }
285  }
286  std::cerr << "nCol / nTotal = " << nCol << " / " << N << std::endl;
287  std::cerr << "nDiff = " << nDiff << std::endl;
288  // statistics
289  clock_t totalTimeGjkColl = 0;
290  clock_t totalTimeGjkNoColl = 0;
291  for (std::size_t i = 0; i < N; ++i) {
292  if (results[i].collision) {
293  totalTimeGjkColl += results[i].timeGjk;
294  } else {
295  totalTimeGjkNoColl += results[i].timeGjk;
296  }
297  }
298  std::cerr << "Total / average time gjk: "
299  << totalTimeGjkNoColl + totalTimeGjkColl << ", "
300  << FCL_REAL(totalTimeGjkNoColl + totalTimeGjkColl) /
301  FCL_REAL(CLOCKS_PER_SEC * N)
302  << "s" << std::endl;
303  std::cerr << "-- Collisions -------------------------" << std::endl;
304  std::cerr << "Total / average time gjk: " << totalTimeGjkColl << ", "
305  << FCL_REAL(totalTimeGjkColl) / FCL_REAL(CLOCKS_PER_SEC * nCol)
306  << "s" << std::endl;
307  std::cerr << "-- No collisions -------------------------" << std::endl;
308  std::cerr << "Total / average time gjk: " << totalTimeGjkNoColl << ", "
309  << FCL_REAL(totalTimeGjkNoColl) /
310  FCL_REAL(CLOCKS_PER_SEC * (N - nCol))
311  << "s" << std::endl;
312 }
313 
314 BOOST_AUTO_TEST_CASE(distance_triangle_triangle_1) {
317 }
318 
319 void test_gjk_unit_sphere(FCL_REAL center_distance, Vec3f ray,
320  bool expect_collision,
321  bool use_gjk_nesterov_acceleration) {
322  using namespace hpp::fcl;
323  Sphere sphere(1.);
324 
325  typedef Eigen::Matrix<FCL_REAL, 4, 1> Vec4f;
326  Transform3f tf0(Quaternion3f(Vec4f::Random().normalized()), Vec3f::Zero()),
327  tf1(Quaternion3f(Vec4f::Random().normalized()), center_distance * ray);
328 
329  details::MinkowskiDiff shape;
330  shape.set(&sphere, &sphere, tf0, tf1);
331 
332  BOOST_CHECK_EQUAL(shape.inflation[0], sphere.radius);
333  BOOST_CHECK_EQUAL(shape.inflation[1], sphere.radius);
334 
335  details::GJK gjk(2, 1e-6);
336  if (use_gjk_nesterov_acceleration)
338  details::GJK::Status status = gjk.evaluate(shape, Vec3f(1, 0, 0));
339 
340  if (expect_collision)
341  BOOST_CHECK_EQUAL(status, details::GJK::Inside);
342  else
343  BOOST_CHECK_EQUAL(status, details::GJK::Valid);
344 
345  Vec3f w0, w1;
346  gjk.getClosestPoints(shape, w0, w1);
347 
348  Vec3f w0_expected(tf0.inverse().transform(tf0.getTranslation() + ray));
349  Vec3f w1_expected(tf0.inverse().transform(tf1.getTranslation() - ray));
350 
351  EIGEN_VECTOR_IS_APPROX(w0, w0_expected, 1e-10);
352  EIGEN_VECTOR_IS_APPROX(w1, w1_expected, 1e-10);
353 }
354 
355 BOOST_AUTO_TEST_CASE(sphere_sphere) {
356  test_gjk_unit_sphere(3., Vec3f(1, 0, 0), false, false);
357  test_gjk_unit_sphere(3., Vec3f(1, 0, 0), false, true);
358  test_gjk_unit_sphere(2.01, Vec3f(1, 0, 0), false, false);
359  test_gjk_unit_sphere(2.01, Vec3f(1, 0, 0), false, true);
360  test_gjk_unit_sphere(2., Vec3f(1, 0, 0), true, false);
361  test_gjk_unit_sphere(2., Vec3f(1, 0, 0), true, true);
362  test_gjk_unit_sphere(1., Vec3f(1, 0, 0), true, false);
363  test_gjk_unit_sphere(1., Vec3f(1, 0, 0), true, true);
364 
365  test_gjk_unit_sphere(3., Vec3f::Random().normalized(), false, false);
366  test_gjk_unit_sphere(3., Vec3f::Random().normalized(), false, true);
367  test_gjk_unit_sphere(2.01, Vec3f::Random().normalized(), false, false);
368  test_gjk_unit_sphere(2.01, Vec3f::Random().normalized(), false, true);
369  test_gjk_unit_sphere(2., Vec3f::Random().normalized(), true, false);
370  test_gjk_unit_sphere(2., Vec3f::Random().normalized(), true, true);
371  test_gjk_unit_sphere(1., Vec3f::Random().normalized(), true, false);
372  test_gjk_unit_sphere(1., Vec3f::Random().normalized(), true, true);
373 }
374 
375 void test_gjk_triangle_capsule(Vec3f T, bool expect_collision,
376  bool use_gjk_nesterov_acceleration,
377  Vec3f w0_expected, Vec3f w1_expected) {
378  using namespace hpp::fcl;
379  Capsule capsule(1., 2.); // Radius 1 and length 2
380  TriangleP triangle(Vec3f(0., 0., 0.), Vec3f(1., 0., 0.), Vec3f(1., 1., 0.));
381 
382  Transform3f tf0, tf1;
383  tf1.setTranslation(T);
384 
385  details::MinkowskiDiff shape;
386  shape.set(&capsule, &triangle, tf0, tf1);
387 
388  BOOST_CHECK_EQUAL(shape.inflation[0], capsule.radius);
389  BOOST_CHECK_EQUAL(shape.inflation[1], 0.);
390 
391  details::GJK gjk(10, 1e-6);
392  if (use_gjk_nesterov_acceleration)
394  details::GJK::Status status = gjk.evaluate(shape, Vec3f(1, 0, 0));
395 
396  if (expect_collision)
397  BOOST_CHECK_EQUAL(status, details::GJK::Inside);
398  else {
399  BOOST_CHECK_EQUAL(status, details::GJK::Valid);
400 
401  // Check that guess works as expected
402  Vec3f guess = gjk.getGuessFromSimplex();
403  details::GJK gjk2(3, 1e-6);
404  details::GJK::Status status2 = gjk2.evaluate(shape, guess);
405  BOOST_CHECK_EQUAL(status2, details::GJK::Valid);
406  }
407 
408  Vec3f w0, w1;
409  if (status == details::GJK::Valid || gjk.hasPenetrationInformation(shape)) {
410  gjk.getClosestPoints(shape, w0, w1);
411  } else {
412  details::EPA epa(128, 64, 255, 1e-6);
413  details::EPA::Status epa_status = epa.evaluate(gjk, Vec3f(1, 0, 0));
414  BOOST_CHECK_EQUAL(epa_status, details::EPA::AccuracyReached);
415  epa.getClosestPoints(shape, w0, w1);
416  }
417 
418  EIGEN_VECTOR_IS_APPROX(w0, w0_expected, 1e-10);
419  EIGEN_VECTOR_IS_APPROX(w1 - T, w1_expected, 1e-10);
420 }
421 
422 BOOST_AUTO_TEST_CASE(triangle_capsule) {
423  // GJK -> no collision
424  test_gjk_triangle_capsule(Vec3f(1.01, 0, 0), false, false, Vec3f(1., 0, 0),
425  Vec3f(0., 0, 0));
426  // GJK + Nesterov acceleration -> no collision
427  test_gjk_triangle_capsule(Vec3f(1.01, 0, 0), false, true, Vec3f(1., 0, 0),
428  Vec3f(0., 0, 0));
429 
430  // GJK -> collision
431  test_gjk_triangle_capsule(Vec3f(0.5, 0, 0), true, false, Vec3f(1., 0, 0),
432  Vec3f(0., 0, 0));
433  // GJK + Nesterov acceleration -> collision
434  test_gjk_triangle_capsule(Vec3f(0.5, 0, 0), true, true, Vec3f(1., 0, 0),
435  Vec3f(0., 0, 0));
436 
437  // GJK + EPA -> collision
438  test_gjk_triangle_capsule(Vec3f(-0.5, -0.01, 0), true, false, Vec3f(0, 1, 0),
439  Vec3f(0.5, 0, 0));
440  // GJK + Nesterov accleration + EPA -> collision
441  test_gjk_triangle_capsule(Vec3f(-0.5, -0.01, 0), true, true, Vec3f(0, 1, 0),
442  Vec3f(0.5, 0, 0));
443 }
hpp::fcl::Vec3f
Eigen::Matrix< FCL_REAL, 3, 1 > Vec3f
Definition: data_types.h:66
vector_t
Eigen::Matrix< FCL_REAL, Eigen::Dynamic, 1 > vector_t
Definition: test/gjk.cpp:57
hpp::fcl::details::EPA::Status
Status
Definition: gjk.h:367
collision_manager.sphere
sphere
Definition: collision_manager.py:4
gjk.tf1
tuple tf1
Definition: test/scripts/gjk.py:27
hpp::fcl::Sphere
Center at zero point sphere.
Definition: shape/geometric_shapes.h:196
hpp::fcl::Capsule::radius
FCL_REAL radius
Radius of capsule.
Definition: shape/geometric_shapes.h:346
gjk.P2
tuple P2
Definition: test/scripts/gjk.py:22
distance
double distance(const std::vector< Transform3f > &tf, const BVHModel< BV > &m1, const BVHModel< BV > &m2, bool verbose)
Definition: benchmark.cpp:93
utility.h
BOOST_AUTO_TEST_CASE
BOOST_AUTO_TEST_CASE(distance_triangle_triangle_1)
Definition: test/gjk.cpp:314
eps
const FCL_REAL eps
Definition: obb.cpp:93
R
R
narrowphase.h
hpp::fcl::GJKSolver::shapeDistance
bool shapeDistance(const S1 &s1, const Transform3f &tf1, const S2 &s2, const Transform3f &tf2, FCL_REAL &distance, Vec3f &p1, Vec3f &p2, Vec3f &normal) const
distance computation between two shapes
Definition: narrowphase.h:261
EIGEN_VECTOR_IS_APPROX
#define EIGEN_VECTOR_IS_APPROX(Va, Vb, precision)
Definition: utility.h:59
hpp::fcl::GJKSolver::gjk_variant
GJKVariant gjk_variant
Variant to use for the GJK algorithm.
Definition: narrowphase.h:505
res
res
hpp::fcl::FCL_REAL
double FCL_REAL
Definition: data_types.h:65
hpp::fcl::details::GJK::Inside
@ Inside
Definition: gjk.h:165
Result::collision
bool collision
Definition: test/gjk.cpp:63
hpp::fcl::details::GJK::Valid
@ Valid
Definition: gjk.h:165
hpp::fcl::GJKSolver
collision and distance solver based on GJK algorithm implemented in fcl (rewritten the code from the ...
Definition: narrowphase.h:54
gjk.Q1
tuple Q1
Definition: test/scripts/gjk.py:24
gjk.P1
tuple P1
Definition: test/scripts/gjk.py:21
hpp::fcl::details::GJK::Status
Status
Status of the GJK algorithm: Valid: GJK converged and the shapes are not in collision....
Definition: gjk.h:165
c
c
gjk.tf2
tuple tf2
Definition: test/scripts/gjk.py:36
M
M
hpp::fcl::Capsule
Capsule It is where is the distance between the point x and the capsule segment AB,...
Definition: shape/geometric_shapes.h:333
Result::timeGjk
clock_t timeGjk
Definition: test/gjk.cpp:64
matrix_t
Eigen::Matrix< FCL_REAL, Eigen::Dynamic, Eigen::Dynamic > matrix_t
Definition: test/gjk.cpp:60
hpp::fcl
Definition: broadphase_bruteforce.h:45
octree.p1
tuple p1
Definition: octree.py:54
Result
Definition: test/gjk.cpp:62
test_gjk_unit_sphere
void test_gjk_unit_sphere(FCL_REAL center_distance, Vec3f ray, bool expect_collision, bool use_gjk_nesterov_acceleration)
Definition: test/gjk.cpp:319
collision
Definition: python_unit/collision.py:1
vector6_t
Eigen::Matrix< FCL_REAL, 6, 1 > vector6_t
Definition: test/gjk.cpp:58
hpp::fcl::Matrix3f
Eigen::Matrix< FCL_REAL, 3, 3 > Matrix3f
Definition: data_types.h:68
hpp::fcl::Transform3f
Simple transform class used locally by InterpMotion.
Definition: transform.h:54
gjk.Q3
tuple Q3
Definition: test/scripts/gjk.py:26
hpp::fcl::details::EPA::AccuracyReached
@ AccuracyReached
Definition: gjk.h:370
Results_t
std::vector< Result > Results_t
Definition: test/gjk.cpp:68
test_gjk_triangle_capsule
void test_gjk_triangle_capsule(Vec3f T, bool expect_collision, bool use_gjk_nesterov_acceleration, Vec3f w0_expected, Vec3f w1_expected)
Definition: test/gjk.cpp:375
hpp::fcl::TriangleP
Triangle stores the points instead of only indices of points.
Definition: shape/geometric_shapes.h:71
vector4_t
Eigen::Matrix< FCL_REAL, 4, 1 > vector4_t
Definition: test/gjk.cpp:59
geometric_shapes.h
tools.h
gjk.P3
tuple P3
Definition: test/scripts/gjk.py:23
c2
c2
test_gjk_distance_triangle_triangle
void test_gjk_distance_triangle_triangle(bool enable_gjk_nesterov_acceleration)
Definition: test/gjk.cpp:70
hpp::fcl::GJKVariant
GJKVariant
Variant to use for the GJK algorithm.
Definition: data_types.h:83
gjk.Q2
tuple Q2
Definition: test/scripts/gjk.py:25
Result::timeGte
clock_t timeGte
Definition: test/gjk.cpp:65
hpp::fcl::Quaternion3f
Eigen::Quaternion< FCL_REAL > Quaternion3f
Definition: transform.h:46
hpp::fcl::NesterovAcceleration
@ NesterovAcceleration
Definition: data_types.h:83
gjk
Definition: doc/gjk.py:1


hpp-fcl
Author(s):
autogenerated on Fri Jan 26 2024 03:46:13