moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Classes | Functions
current_state_monitor_tests.cpp File Reference
#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>
Include dependency graph for current_state_monitor_tests.cpp:

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)
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 209 of file current_state_monitor_tests.cpp.

◆ TEST() [1/8]

TEST ( CurrentStateMonitorTests  ,
DestructStopTest   
)

Definition at line 139 of file current_state_monitor_tests.cpp.

Here is the call graph for this function:

◆ TEST() [2/8]

TEST ( CurrentStateMonitorTests  ,
HaveCompleteStateConstructFalse   
)

Definition at line 172 of file current_state_monitor_tests.cpp.

Here is the call graph for this function:

◆ TEST() [3/8]

TEST ( CurrentStateMonitorTests  ,
NoModelTest   
)

Definition at line 159 of file current_state_monitor_tests.cpp.

◆ TEST() [4/8]

TEST ( CurrentStateMonitorTests  ,
StartActiveTest   
)

Definition at line 87 of file current_state_monitor_tests.cpp.

Here is the call graph for this function:

◆ TEST() [5/8]

TEST ( CurrentStateMonitorTests  ,
StartCreateSubscriptionTest   
)

Definition at line 71 of file current_state_monitor_tests.cpp.

Here is the call graph for this function:

◆ TEST() [6/8]

TEST ( CurrentStateMonitorTests  ,
StopNotActiveTest   
)

Definition at line 121 of file current_state_monitor_tests.cpp.

Here is the call graph for this function:

◆ TEST() [7/8]

TEST ( CurrentStateMonitorTests  ,
StopResetSubscriptionTest   
)

Definition at line 102 of file current_state_monitor_tests.cpp.

Here is the call graph for this function:

◆ TEST() [8/8]

TEST ( CurrentStateMonitorTests  ,
WaitForCompleteStateWaits   
)

Definition at line 185 of file current_state_monitor_tests.cpp.

Here is the call graph for this function: