Panda_grasping
|
The specific functions of test. More...
#include "ros/ros.h"
#include "tf2_geometry_msgs/tf2_geometry_msgs.h"
#include "tf2/LinearMath/Quaternion.h"
#include "tf2/LinearMath/Vector3.h"
#include <moveit/planning_scene_interface/planning_scene_interface.h>
#include <moveit/move_group_interface/move_group_interface.h>
#include "panda_grasping/PickObject.h"
#include "panda_grasping/PlaceObject.h"
#include <gtest/gtest.h>
Classes | |
class | Grasping |
Functions | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_0_FromTo_01) | |
Pick and place object 0 from point 0 to point 1 without orientation. | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_0_FromTo_Null1) | |
Pick and place object 0 to point 1 without orientation. | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_1_FromTo_01) | |
Pick and place object 1 from point 0 to point 1 without orientation. | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_2_FromTo_01) | |
Pick and place object 2 from point 0 to point 1 without orientation. | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_0_FromTo_1Null) | |
Pick and place object 0 from point 1 to nullLocation without orientation. | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_0_FromTo_01_23) | |
Pick and place object 0 from point 0 to point 1 without orientation clean up scene pick and place object 0 from point 2 to point 3 without orientation. | |
TEST_F (Grasping, Grasping_WithoutRotation_Object_0_FromTo_01_12) | |
Pick and place object 0 from point 0 to point 1 without orientation clean up scene pick and place object 0 from point 1 to point 2 without orientation. | |
TEST_F (Grasping, GraspingWithRotation_Object_0_Rotations_00) | |
Pick and place object 0 from point 0 to point 1 with angle 0. | |
TEST_F (Grasping, GraspingWithRotation_Object_0_Rotations_01) | |
Pick and place object 0 from point 0 to point 1 and rotate from angle 0 to angle 1. | |
TEST_F (Grasping, GraspingWithRotation_Object_0_Rotations_12) | |
Pick and place object 0 from point 0 to point 1 and rotate from angle 1 to angle 2. | |
int | main (int argc, char **argv) |
The specific functions of test.
int main | ( | int | argc, |
char ** | argv | ||
) |
Main function