#include <gtest/gtest.h>#include <moveit/planning_scene/planning_scene.h>#include <moveit/utils/message_checks.h>#include <moveit/utils/robot_model_test_utils.h>#include <urdf_parser/urdf_parser.h>#include <fstream>#include <sstream>#include <string>#include <boost/filesystem/path.hpp>#include <ros/package.h>#include <octomap_msgs/conversions.h>#include <octomap/octomap.h>#include <moveit/collision_detection/collision_common.h>#include <moveit/collision_detection/collision_plugin_cache.h>
Go to the source code of this file.
Classes | |
| class | CollisionDetectorTests |
Macros | |
| #define | INSTANTIATE_TEST_SUITE_P(...) INSTANTIATE_TEST_CASE_P(__VA_ARGS__) |
Functions | |
| moveit_msgs::PlanningScene | create_planning_scene_diff (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 > | get_attached_collision_objects_names (const planning_scene::PlanningScene &ps) |
| std::set< std::string > | get_collision_objects_names (const planning_scene::PlanningScene &ps) |
| INSTANTIATE_TEST_SUITE_P (PluginTests, CollisionDetectorTests, testing::Values("FCL", "Bullet")) | |
| int | main (int argc, char **argv) |
| 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, UpdateACMAfterObjectRemoval) | |
| TEST_P (CollisionDetectorTests, ClearDiff) | |
| #define INSTANTIATE_TEST_SUITE_P | ( | ... | ) | INSTANTIATE_TEST_CASE_P(__VA_ARGS__) |
Definition at line 620 of file test_planning_scene.cpp.
| moveit_msgs::PlanningScene create_planning_scene_diff | ( | 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 404 of file test_planning_scene.cpp.
| std::set<std::string> get_attached_collision_objects_names | ( | const planning_scene::PlanningScene & | ps | ) |
Definition at line 460 of file test_planning_scene.cpp.
| std::set<std::string> get_collision_objects_names | ( | const planning_scene::PlanningScene & | ps | ) |
Definition at line 449 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 626 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| FailRetrievingNonExistentObject | |||
| ) |
Definition at line 307 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| isStateValid | |||
| ) |
Definition at line 211 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| loadBadSceneGeometry | |||
| ) |
Definition at line 283 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| loadGoodSceneGeometryNewFormat | |||
| ) |
Definition at line 222 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| loadGoodSceneGeometryOldFormat | |||
| ) |
Definition at line 257 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| LoadOctomap | |||
| ) |
Definition at line 67 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| LoadRestore | |||
| ) |
Definition at line 53 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| LoadRestoreDiff | |||
| ) |
Definition at line 120 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| MakeAttachedDiff | |||
| ) |
Definition at line 180 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| RobotStateDiffBug | |||
| ) |
Definition at line 470 of file test_planning_scene.cpp.
| TEST | ( | PlanningScene | , |
| UpdateACMAfterObjectRemoval | |||
| ) |
Definition at line 545 of file test_planning_scene.cpp.
| TEST_P | ( | CollisionDetectorTests | , |
| ClearDiff | |||
| ) |
Definition at line 318 of file test_planning_scene.cpp.