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.h>
#include <moveit/utils/robot_model_test_utils.h>
#include <rclcpp/rclcpp.hpp>
#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 202 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
DestructStopTest | |||
) |
Definition at line 132 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
HaveCompleteStateConstructFalse | |||
) |
Definition at line 165 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
NoModelTest | |||
) |
Definition at line 152 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
StartActiveTest | |||
) |
Definition at line 80 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
StartCreateSubscriptionTest | |||
) |
Definition at line 64 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
StopNotActiveTest | |||
) |
Definition at line 114 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
StopResetSubscriptionTest | |||
) |
Definition at line 95 of file current_state_monitor_tests.cpp.
TEST | ( | CurrentStateMonitorTests | , |
WaitForCompleteStateWaits | |||
) |
Definition at line 178 of file current_state_monitor_tests.cpp.