moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Classes | Functions
trajectory_monitor_tests.cpp File Reference
#include <memory>
#include <chrono>
#include <thread>
#include <atomic>
#include <gmock/gmock.h>
#include <gtest/gtest.h>
#include <moveit/planning_scene_monitor/trajectory_monitor.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>
Include dependency graph for trajectory_monitor_tests.cpp:

Go to the source code of this file.

Classes

struct  MockTrajectoryMonitorMiddlewareHandle
 
struct  MockCurrentStateMonitorMiddlewareHandle
 

Functions

void waitFor (std::chrono::seconds timeout, const std::function< bool()> &done)
 
 TEST (TrajectoryMonitorTests, SleepAtLeastOnce)
 
int main (int argc, char **argv)
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 113 of file trajectory_monitor_tests.cpp.

◆ TEST()

TEST ( TrajectoryMonitorTests  ,
SleepAtLeastOnce   
)

Definition at line 86 of file trajectory_monitor_tests.cpp.

Here is the call graph for this function:

◆ waitFor()

void waitFor ( std::chrono::seconds  timeout,
const std::function< bool()> &  done 
)

Definition at line 73 of file trajectory_monitor_tests.cpp.

Here is the caller graph for this function: