#include <ros/ros.h>#include <gtest/gtest.h>#include <pr2_plugs_common/joint_space_move.h>#include <string.h>#include <pr2_controllers_msgs/JointTrajectoryGoal.h>#include <pr2_controllers_msgs/JointTrajectoryAction.h>#include <actionlib/client/simple_action_client.h>#include <boost/thread/condition.hpp>#include <boost/thread.hpp>#include <boost/shared_ptr.hpp>#include <actionlib_msgs/GoalID.h>#include <actionlib_msgs/GoalStatusArray.h>#include <actionlib_msgs/GoalStatus.h>#include <actionlib/enclosure_deleter.h>#include <actionlib/goal_id_generator.h>#include <actionlib/action_definition.h>#include <actionlib/server/status_tracker.h>#include <actionlib/destruction_guard.h>#include <list>

Go to the source code of this file.
Typedefs | |
| typedef actionlib::SimpleActionServer < pr2_controllers_msgs::JointTrajectoryAction > | Server |
Functions | |
| void | execute (const pr2_controllers_msgs::JointTrajectoryGoalConstPtr &goal, Server *as) |
| int | main (int argc, char **argv) |
| void | spinThread () |
| TEST (JointSpaceMove, test_failure) | |
| typedef actionlib::SimpleActionServer<pr2_controllers_msgs::JointTrajectoryAction> Server |
Definition at line 39 of file joint_space_move_test.cpp.
| void execute | ( | const pr2_controllers_msgs::JointTrajectoryGoalConstPtr & | goal, | |
| Server * | as | |||
| ) |
Definition at line 41 of file joint_space_move_test.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 64 of file joint_space_move_test.cpp.
| void spinThread | ( | ) |
Definition at line 51 of file joint_space_move_test.cpp.
| TEST | ( | JointSpaceMove | , | |
| test_failure | ||||
| ) |
Definition at line 57 of file joint_space_move_test.cpp.