#include <gtest/gtest.h>
#include "fcl/config.h"
#include "fcl/geometry/octree/octree.h"
#include "fcl/narrowphase/collision.h"
#include "fcl/broadphase/broadphase_bruteforce.h"
#include "fcl/broadphase/broadphase_spatialhash.h"
#include "fcl/broadphase/broadphase_SaP.h"
#include "fcl/broadphase/broadphase_SSaP.h"
#include "fcl/broadphase/broadphase_interval_tree.h"
#include "fcl/broadphase/broadphase_dynamic_AABB_tree.h"
#include "fcl/broadphase/broadphase_dynamic_AABB_tree_array.h"
#include "fcl/broadphase/default_broadphase_callbacks.h"
#include "fcl/geometry/geometric_shape_to_BVH_model.h"
#include "test_fcl_utility.h"
#include "fcl_resources/config.h"
Go to the source code of this file.
Functions | |
GTEST_TEST (FCL_OCTOMAP, test_octomap_bvh_obb_collision_obb) | |
GTEST_TEST (FCL_OCTOMAP, test_octomap_collision) | |
GTEST_TEST (FCL_OCTOMAP, test_octomap_collision_contact_primitive_id) | |
GTEST_TEST (FCL_OCTOMAP, test_octomap_collision_mesh) | |
GTEST_TEST (FCL_OCTOMAP, test_octomap_collision_mesh_octomap_box) | |
int | main (int argc, char *argv[]) |
template<typename S > | |
void | octomap_collision_test (S env_scale, std::size_t env_size, bool exhaustive, std::size_t num_max_contacts, bool use_mesh, bool use_mesh_octomap, double resolution=0.1) |
Octomap collision with an environment with 3 * env_size objects. More... | |
template<typename BV > | |
void | octomap_collision_test_BVH (std::size_t n, bool exhaustive, double resolution=0.1) |
template<typename S > | |
void | octomap_collision_test_contact_primitive_id (S env_scale, std::size_t env_size, std::size_t num_max_contacts, double resolution=0.1) |
Octomap collision with an environment mesh with 3 * env_size objects, asserting that correct triangle ids are returned when performing collision tests. More... | |
template<typename S > | |
void | test_octomap_bvh_obb_collision_obb () |
template<typename S > | |
void | test_octomap_collision () |
template<typename S > | |
void | test_octomap_collision_contact_primitive_id () |
template<typename S > | |
void | test_octomap_collision_mesh () |
template<typename S > | |
void | test_octomap_collision_mesh_octomap_box () |
GTEST_TEST | ( | FCL_OCTOMAP | , |
test_octomap_bvh_obb_collision_obb | |||
) |
Definition at line 163 of file test_fcl_octomap_collision.cpp.
GTEST_TEST | ( | FCL_OCTOMAP | , |
test_octomap_collision | |||
) |
Definition at line 89 of file test_fcl_octomap_collision.cpp.
GTEST_TEST | ( | FCL_OCTOMAP | , |
test_octomap_collision_contact_primitive_id | |||
) |
Definition at line 125 of file test_fcl_octomap_collision.cpp.
GTEST_TEST | ( | FCL_OCTOMAP | , |
test_octomap_collision_mesh | |||
) |
Definition at line 109 of file test_fcl_octomap_collision.cpp.
GTEST_TEST | ( | FCL_OCTOMAP | , |
test_octomap_collision_mesh_octomap_box | |||
) |
Definition at line 145 of file test_fcl_octomap_collision.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 416 of file test_fcl_octomap_collision.cpp.
void octomap_collision_test | ( | S | env_scale, |
std::size_t | env_size, | ||
bool | exhaustive, | ||
std::size_t | num_max_contacts, | ||
bool | use_mesh, | ||
bool | use_mesh_octomap, | ||
double | resolution = 0.1 |
||
) |
Octomap collision with an environment with 3 * env_size objects.
Definition at line 255 of file test_fcl_octomap_collision.cpp.
void octomap_collision_test_BVH | ( | std::size_t | n, |
bool | exhaustive, | ||
double | resolution = 0.1 |
||
) |
Definition at line 170 of file test_fcl_octomap_collision.cpp.
void octomap_collision_test_contact_primitive_id | ( | S | env_scale, |
std::size_t | env_size, | ||
std::size_t | num_max_contacts, | ||
double | resolution = 0.1 |
||
) |
Octomap collision with an environment mesh with 3 * env_size objects, asserting that correct triangle ids are returned when performing collision tests.
Definition at line 354 of file test_fcl_octomap_collision.cpp.
void test_octomap_bvh_obb_collision_obb | ( | ) |
Definition at line 152 of file test_fcl_octomap_collision.cpp.
void test_octomap_collision | ( | ) |
Definition at line 74 of file test_fcl_octomap_collision.cpp.
void test_octomap_collision_contact_primitive_id | ( | ) |
Definition at line 116 of file test_fcl_octomap_collision.cpp.
void test_octomap_collision_mesh | ( | ) |
Definition at line 96 of file test_fcl_octomap_collision.cpp.
void test_octomap_collision_mesh_octomap_box | ( | ) |
Definition at line 132 of file test_fcl_octomap_collision.cpp.