|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <chrono>#include <memory>#include <string>#include <gmock/gmock.h>#include <gtest/gtest.h>#include <moveit/planning_scene_monitor/current_state_monitor.hpp>#include <moveit/utils/robot_model_test_utils.hpp>#include <rclcpp/rclcpp.hpp>#include <rclcpp/version.h>#include <tf2_ros/buffer.h>
Go to the source code of this file.
Classes | |
| struct | MockMiddlewareHandle |
Functions | |
| TEST (CurrentStateMonitorTests, StartCreateSubscriptionTest) | |
| TEST (CurrentStateMonitorTests, StartActiveTest) | |
| TEST (CurrentStateMonitorTests, StopResetSubscriptionTest) | |
| TEST (CurrentStateMonitorTests, StopNotActiveTest) | |
| TEST (CurrentStateMonitorTests, DestructStopTest) | |
| TEST (CurrentStateMonitorTests, NoModelTest) | |
| TEST (CurrentStateMonitorTests, HaveCompleteStateConstructFalse) | |
| TEST (CurrentStateMonitorTests, WaitForCompleteStateWaits) | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 209 of file current_state_monitor_tests.cpp.
| TEST | ( | CurrentStateMonitorTests | , |
| DestructStopTest | |||
| ) |
Definition at line 139 of file current_state_monitor_tests.cpp.

| TEST | ( | CurrentStateMonitorTests | , |
| HaveCompleteStateConstructFalse | |||
| ) |
Definition at line 172 of file current_state_monitor_tests.cpp.

| TEST | ( | CurrentStateMonitorTests | , |
| NoModelTest | |||
| ) |
Definition at line 159 of file current_state_monitor_tests.cpp.
| TEST | ( | CurrentStateMonitorTests | , |
| StartActiveTest | |||
| ) |
Definition at line 87 of file current_state_monitor_tests.cpp.

| TEST | ( | CurrentStateMonitorTests | , |
| StartCreateSubscriptionTest | |||
| ) |
Definition at line 71 of file current_state_monitor_tests.cpp.

| TEST | ( | CurrentStateMonitorTests | , |
| StopNotActiveTest | |||
| ) |
Definition at line 121 of file current_state_monitor_tests.cpp.

| TEST | ( | CurrentStateMonitorTests | , |
| StopResetSubscriptionTest | |||
| ) |
Definition at line 102 of file current_state_monitor_tests.cpp.

| TEST | ( | CurrentStateMonitorTests | , |
| WaitForCompleteStateWaits | |||
| ) |
Definition at line 185 of file current_state_monitor_tests.cpp.
