| 
    moveit2
    
   The MoveIt Motion Planning Framework for ROS 2. 
   | 
 
#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>
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) | 
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 200 of file trajectory_test.cpp.
| TEST_F | ( | TrajectoryTest | , | 
| concatVectorValidation | |||
| ) | 
| TEST_F | ( | TrajectoryTest | , | 
| goalTolerance | |||
| ) | 
Definition at line 89 of file trajectory_test.cpp.