Go to the source code of this file.
|
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_P (CollisionDetectorTests, ClearDiff) |
|
◆ INSTANTIATE_TEST_SUITE_P
◆ create_planning_scene_diff()
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 |
|
) |
| |
◆ get_attached_collision_objects_names()
◆ get_collision_objects_names()
◆ INSTANTIATE_TEST_SUITE_P()
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ TEST() [1/10]
TEST |
( |
PlanningScene |
, |
|
|
FailRetrievingNonExistentObject |
|
|
) |
| |
◆ TEST() [2/10]
TEST |
( |
PlanningScene |
, |
|
|
isStateValid |
|
|
) |
| |
◆ TEST() [3/10]
TEST |
( |
PlanningScene |
, |
|
|
loadBadSceneGeometry |
|
|
) |
| |
◆ TEST() [4/10]
TEST |
( |
PlanningScene |
, |
|
|
loadGoodSceneGeometryNewFormat |
|
|
) |
| |
◆ TEST() [5/10]
TEST |
( |
PlanningScene |
, |
|
|
loadGoodSceneGeometryOldFormat |
|
|
) |
| |
◆ TEST() [6/10]
TEST |
( |
PlanningScene |
, |
|
|
LoadOctomap |
|
|
) |
| |
◆ TEST() [7/10]
TEST |
( |
PlanningScene |
, |
|
|
LoadRestore |
|
|
) |
| |
◆ TEST() [8/10]
TEST |
( |
PlanningScene |
, |
|
|
LoadRestoreDiff |
|
|
) |
| |
◆ TEST() [9/10]
TEST |
( |
PlanningScene |
, |
|
|
MakeAttachedDiff |
|
|
) |
| |
◆ TEST() [10/10]
TEST |
( |
PlanningScene |
, |
|
|
RobotStateDiffBug |
|
|
) |
| |
◆ TEST_P()