#include <ros/ros.h>
#include <gtest/gtest.h>
#include <moveit/utils/robot_model_test_utils.h>
#include <moveit/planning_scene_monitor/current_state_monitor.h>
#include <sensor_msgs/JointState.h>
#include <future>
Go to the source code of this file.
Classes | |
class | CurrentStateMonitorTest |
Functions | |
int | main (int argc, char **argv) |
TEST_F (CurrentStateMonitorTest, CompleteStateTest) | |
TEST_F (CurrentStateMonitorTest, IncrementalTimeStamps) | |
TEST_F (CurrentStateMonitorTest, NonMonotonicTimeStampsDueToPartialJoints) | |
TEST_F (CurrentStateMonitorTest, StateUpdateTest) | |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 191 of file current_state_monitor_test.cpp.
TEST_F | ( | CurrentStateMonitorTest | , |
CompleteStateTest | |||
) |
Definition at line 122 of file current_state_monitor_test.cpp.
TEST_F | ( | CurrentStateMonitorTest | , |
IncrementalTimeStamps | |||
) |
Definition at line 146 of file current_state_monitor_test.cpp.
TEST_F | ( | CurrentStateMonitorTest | , |
NonMonotonicTimeStampsDueToPartialJoints | |||
) |
Definition at line 173 of file current_state_monitor_test.cpp.
TEST_F | ( | CurrentStateMonitorTest | , |
StateUpdateTest | |||
) |
Definition at line 135 of file current_state_monitor_test.cpp.