|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/robot_model/robot_model.hpp>#include <moveit/robot_state/robot_state.hpp>#include <moveit/utils/robot_model_test_utils.hpp>#include <moveit/planning_scene/planning_scene.hpp>#include <gtest/gtest.h>#include <thread>#include <moveit/collision_detection/collision_common.hpp>#include <moveit/collision_detection/collision_plugin_cache.hpp>
Go to the source code of this file.
Classes | |
| class | CollisionDetectorTests |
Macros | |
| #define | INSTANTIATE_TEST_SUITE_P(...) INSTANTIATE_TEST_CASE_P(__VA_ARGS__) |
Functions | |
| bool | runCollisionDetection (unsigned int, unsigned int trials, const planning_scene::PlanningScene &scene, const moveit::core::RobotState &state) |
| void | runCollisionDetectionAssert (unsigned int id, unsigned int trials, const planning_scene::PlanningScene &scene, const moveit::core::RobotState &state, bool expected_result) |
| TEST_P (CollisionDetectorTests, Threaded) | |
| Tests the collision detector in multiple threads. | |
| INSTANTIATE_TEST_SUITE_P (PluginTests, CollisionDetectorTests, testing::Values("FCL", "Bullet")) | |
| int | main (int argc, char **argv) |
Variables | |
| const int | TRIALS = 1000 |
| const int | THREADS = 2 |
| #define INSTANTIATE_TEST_SUITE_P | ( | ... | ) | INSTANTIATE_TEST_CASE_P(__VA_ARGS__) |
Definition at line 145 of file test_multi_threaded.cpp.
| INSTANTIATE_TEST_SUITE_P | ( | PluginTests | , |
| CollisionDetectorTests | , | ||
| testing::Values("FCL", "Bullet") | |||
| ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 151 of file test_multi_threaded.cpp.
| bool runCollisionDetection | ( | unsigned int | , |
| unsigned int | trials, | ||
| const planning_scene::PlanningScene & | scene, | ||
| const moveit::core::RobotState & | state | ||
| ) |
Definition at line 50 of file test_multi_threaded.cpp.


| void runCollisionDetectionAssert | ( | unsigned int | id, |
| unsigned int | trials, | ||
| const planning_scene::PlanningScene & | scene, | ||
| const moveit::core::RobotState & | state, | ||
| bool | expected_result | ||
| ) |
Definition at line 63 of file test_multi_threaded.cpp.


| TEST_P | ( | CollisionDetectorTests | , |
| Threaded | |||
| ) |
Tests the collision detector in multiple threads.
Definition at line 99 of file test_multi_threaded.cpp.

| const int THREADS = 2 |
Definition at line 48 of file test_multi_threaded.cpp.
| const int TRIALS = 1000 |
Definition at line 47 of file test_multi_threaded.cpp.