Classes | Functions | Variables
move_group_interface_cpp_test.cpp File Reference
#include <string>
#include <vector>
#include <map>
#include <future>
#include <ros/ros.h>
#include <gtest/gtest.h>
#include <moveit/planning_scene_interface/planning_scene_interface.h>
#include <moveit/move_group_interface/move_group_interface.h>
#include <moveit/common_planning_interface_objects/common_objects.h>
#include <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <tf2_eigen/tf2_eigen.h>
Include dependency graph for move_group_interface_cpp_test.cpp:

Go to the source code of this file.

Classes

class  MoveGroupTestFixture
 

Functions

int main (int argc, char **argv)
 
 TEST_F (MoveGroupTestFixture, CartesianGoalTest)
 
 TEST_F (MoveGroupTestFixture, CartPathTest)
 
 TEST_F (MoveGroupTestFixture, JointSpaceGoalTest)
 
 TEST_F (MoveGroupTestFixture, ModifyPlanningSceneAsyncInterfaces)
 
 TEST_F (MoveGroupTestFixture, PathConstraintCollisionTest)
 

Variables

constexpr double EPSILON = 1e-5
 
constexpr double GOAL_TOLERANCE = 1e-6
 
constexpr double MAX_ACCELERATION_SCALE = 1.0
 
constexpr double MAX_VELOCITY_SCALE = 1.0
 
static const std::string PLANNING_GROUP = "panda_arm"
 
constexpr double PLANNING_TIME_S = 30.0
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 360 of file move_group_interface_cpp_test.cpp.

◆ TEST_F() [1/5]

TEST_F ( MoveGroupTestFixture  ,
CartesianGoalTest   
)

Definition at line 348 of file move_group_interface_cpp_test.cpp.

◆ TEST_F() [2/5]

TEST_F ( MoveGroupTestFixture  ,
CartPathTest   
)

Definition at line 291 of file move_group_interface_cpp_test.cpp.

◆ TEST_F() [3/5]

TEST_F ( MoveGroupTestFixture  ,
JointSpaceGoalTest   
)

Definition at line 327 of file move_group_interface_cpp_test.cpp.

◆ TEST_F() [4/5]

TEST_F ( MoveGroupTestFixture  ,
ModifyPlanningSceneAsyncInterfaces   
)

Definition at line 243 of file move_group_interface_cpp_test.cpp.

◆ TEST_F() [5/5]

TEST_F ( MoveGroupTestFixture  ,
PathConstraintCollisionTest   
)

Definition at line 183 of file move_group_interface_cpp_test.cpp.

Variable Documentation

◆ EPSILON

constexpr double EPSILON = 1e-5
constexpr

Definition at line 65 of file move_group_interface_cpp_test.cpp.

◆ GOAL_TOLERANCE

constexpr double GOAL_TOLERANCE = 1e-6
constexpr

Definition at line 71 of file move_group_interface_cpp_test.cpp.

◆ MAX_ACCELERATION_SCALE

constexpr double MAX_ACCELERATION_SCALE = 1.0
constexpr

Definition at line 70 of file move_group_interface_cpp_test.cpp.

◆ MAX_VELOCITY_SCALE

constexpr double MAX_VELOCITY_SCALE = 1.0
constexpr

Definition at line 69 of file move_group_interface_cpp_test.cpp.

◆ PLANNING_GROUP

const std::string PLANNING_GROUP = "panda_arm"
static

Definition at line 67 of file move_group_interface_cpp_test.cpp.

◆ PLANNING_TIME_S

constexpr double PLANNING_TIME_S = 30.0
constexpr

Definition at line 68 of file move_group_interface_cpp_test.cpp.



planning_interface
Author(s): Ioan Sucan
autogenerated on Sat Apr 27 2024 02:27:01