#include <time.h>
#include <ros/ros.h>
#include <actionlib/client/simple_action_client.h>
#include <gtest/gtest.h>
#include <sensor_msgs/JointState.h>
#include <iri_wam_common_msgs/SimpleBhandPickUpAction.h>
#include <object_manipulation_msgs/GripperTranslation.h>
#include "geometry_test_helpers.h"
#include "iri_bhand_fake_recorder.cpp"
#include "iri_wam_joint_move_fake_recorder.cpp"
#include "iri_ik_fake_recorder.cpp"
#include "../../include/grasp_actions_alg_node.h"
Go to the source code of this file.
Functions | |
std::vector< double > | get_random_seven_joints_position () |
int | main (int argc, char **argv) |
TEST (Bhand, constructor) | |
TEST (Bhand, simple_cmd) | |
TEST (JointsMove, constructor) | |
TEST (JointsMove, simple_cmd) | |
TEST (JointsMove, bad_joints) | |
TEST (IK, constructor) | |
TEST (IK, simple_ik) | |
TEST (GraspActions, constructor) | |
TEST (GraspActions, test_movement) | |
Variables | |
const size_t | DOF = 7 |
std::string | ns = "/iri_grasp_actions_test/" |
std::vector<double> get_random_seven_joints_position | ( | ) |
Definition at line 19 of file iri_grasp_actions_test.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 195 of file iri_grasp_actions_test.cpp.
TEST | ( | Bhand | , |
constructor | |||
) |
Definition at line 33 of file iri_grasp_actions_test.cpp.
TEST | ( | Bhand | , |
simple_cmd | |||
) |
Definition at line 41 of file iri_grasp_actions_test.cpp.
TEST | ( | JointsMove | , |
constructor | |||
) |
Definition at line 59 of file iri_grasp_actions_test.cpp.
TEST | ( | JointsMove | , |
simple_cmd | |||
) |
Definition at line 67 of file iri_grasp_actions_test.cpp.
TEST | ( | JointsMove | , |
bad_joints | |||
) |
Definition at line 84 of file iri_grasp_actions_test.cpp.
TEST | ( | IK | , |
constructor | |||
) |
Definition at line 103 of file iri_grasp_actions_test.cpp.
TEST | ( | IK | , |
simple_ik | |||
) |
Definition at line 111 of file iri_grasp_actions_test.cpp.
TEST | ( | GraspActions | , |
constructor | |||
) |
Definition at line 129 of file iri_grasp_actions_test.cpp.
TEST | ( | GraspActions | , |
test_movement | |||
) |
Definition at line 137 of file iri_grasp_actions_test.cpp.
const size_t DOF = 7 |
Definition at line 17 of file iri_grasp_actions_test.cpp.
std::string ns = "/iri_grasp_actions_test/" |
Definition at line 31 of file iri_grasp_actions_test.cpp.