|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <gtest/gtest.h>#include <moveit/collision_detection_fcl/collision_detector_allocator_fcl.hpp>#include <moveit/planning_scene/planning_scene.hpp>#include <moveit/utils/message_checks.hpp>#include <moveit/utils/robot_model_test_utils.hpp>#include <urdf_parser/urdf_parser.h>#include <fstream>#include <sstream>#include <string>#include <tf2_eigen/tf2_eigen.hpp>#include <octomap_msgs/conversions.h>#include <octomap/octomap.h>#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 | |
| TEST (PlanningScene, TestOneShapeObjectPose) | |
| TEST (PlanningScene, LoadRestore) | |
| TEST (PlanningScene, LoadOctomap) | |
| TEST (PlanningScene, LoadRestoreDiff) | |
| TEST (PlanningScene, MakeAttachedDiff) | |
| TEST (PlanningScene, isStateValid) | |
| TEST (PlanningScene, loadGoodSceneGeometryNewFormat) | |
| TEST (PlanningScene, loadGoodSceneGeometryOldFormat) | |
| TEST (PlanningScene, loadBadSceneGeometry) | |
| TEST (PlanningScene, switchCollisionDetectorType) | |
| TEST (PlanningScene, FailRetrievingNonExistentObject) | |
| TEST_P (CollisionDetectorTests, ClearDiff) | |
| moveit_msgs::msg::PlanningScene | createPlanningSceneDiff (const planning_scene::PlanningScene &ps, const std::string &object_name, const int8_t operation, const bool attach_object=false, const bool create_object=true) |
| std::set< std::string > | getCollisionObjectsNames (const planning_scene::PlanningScene &ps) |
| std::set< std::string > | getAttachedCollisionObjectsNames (const planning_scene::PlanningScene &ps) |
| TEST (PlanningScene, RobotStateDiffBug) | |
| TEST (PlanningScene, UpdateACMAfterObjectRemoval) | |
| INSTANTIATE_TEST_SUITE_P (PluginTests, CollisionDetectorTests, testing::Values("FCL", "Bullet")) | |
| int | main (int argc, char **argv) |
| #define INSTANTIATE_TEST_SUITE_P | ( | ... | ) | INSTANTIATE_TEST_CASE_P(__VA_ARGS__) |
Definition at line 668 of file test_planning_scene.cpp.
| moveit_msgs::msg::PlanningScene createPlanningSceneDiff | ( | const planning_scene::PlanningScene & | ps, |
| const std::string & | object_name, | ||
| const int8_t | operation, | ||
| const bool | attach_object = false, |
||
| const bool | create_object = true |
||
| ) |
Definition at line 450 of file test_planning_scene.cpp.


| std::set< std::string > getAttachedCollisionObjectsNames | ( | const planning_scene::PlanningScene & | ps | ) |
Definition at line 507 of file test_planning_scene.cpp.


| std::set< std::string > getCollisionObjectsNames | ( | const planning_scene::PlanningScene & | ps | ) |
Definition at line 496 of file test_planning_scene.cpp.


| INSTANTIATE_TEST_SUITE_P | ( | PluginTests | , |
| CollisionDetectorTests | , | ||
| testing::Values("FCL", "Bullet") | |||
| ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 674 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| FailRetrievingNonExistentObject | |||
| ) |
| TEST | ( | PlanningScene | , |
| isStateValid | |||
| ) |
| TEST | ( | PlanningScene | , |
| loadBadSceneGeometry | |||
| ) |
| TEST | ( | PlanningScene | , |
| loadGoodSceneGeometryNewFormat | |||
| ) |
| TEST | ( | PlanningScene | , |
| loadGoodSceneGeometryOldFormat | |||
| ) |
| TEST | ( | PlanningScene | , |
| LoadOctomap | |||
| ) |
| TEST | ( | PlanningScene | , |
| LoadRestore | |||
| ) |
| TEST | ( | PlanningScene | , |
| LoadRestoreDiff | |||
| ) |
| TEST | ( | PlanningScene | , |
| MakeAttachedDiff | |||
| ) |
| TEST | ( | PlanningScene | , |
| RobotStateDiffBug | |||
| ) |
| TEST | ( | PlanningScene | , |
| switchCollisionDetectorType | |||
| ) |
| TEST | ( | PlanningScene | , |
| TestOneShapeObjectPose | |||
| ) |
| TEST | ( | PlanningScene | , |
| UpdateACMAfterObjectRemoval | |||
| ) |
| TEST_P | ( | CollisionDetectorTests | , |
| ClearDiff | |||
| ) |