moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Functions
trajectory_test.cpp File Reference
#include <iostream>
#include <string>
#include <cmath>
#include <ros/ros.h>
#include <gtest/gtest.h>
#include <trajopt/common.hpp>
#include <moveit/planning_interface/planning_interface.h>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <moveit/planning_scene/planning_scene.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/utils/robot_model_test_utils.h>
#include <trajopt_interface/problem_description.h>
#include <trajopt_interface/kinematic_terms.h>
#include <moveit/kinematic_constraints/utils.h>
#include <moveit/move_group_interface/move_group_interface.h>
#include <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <moveit_msgs/MotionPlanResponse.h>
Include dependency graph for trajectory_test.cpp:

Go to the source code of this file.

Classes

class  TrajectoryTest
 

Functions

 TEST_F (TrajectoryTest, concatVectorValidation)
 
 TEST_F (TrajectoryTest, goalTolerance)
 
int main (int argc, char **argv)
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 200 of file trajectory_test.cpp.

◆ TEST_F() [1/2]

TEST_F ( TrajectoryTest  ,
concatVectorValidation   
)

Definition at line 66 of file trajectory_test.cpp.

Here is the call graph for this function:

◆ TEST_F() [2/2]

TEST_F ( TrajectoryTest  ,
goalTolerance   
)

Definition at line 89 of file trajectory_test.cpp.