#include <gtest/gtest.h>
#include <boost/thread.hpp>
#include <ros/ros.h>
#include <ros/time.h>
#include <actionlib/client/simple_action_client.h>
#include <sensor_msgs/JointState.h>
#include "play_motion_msgs/PlayMotionAction.h"
Go to the source code of this file.
Classes | |
class | PlayMotionTestClient |
Typedefs | |
typedef actionlib::SimpleClientGoalState | GS |
typedef play_motion_msgs::PlayMotionResult | PMR |
Functions | |
int | main (int argc, char **argv) |
TEST (PlayMotionTest, basicReachPose) | |
TEST (PlayMotionTest, rejectSecondGoal) | |
TEST (PlayMotionTest, badMotionName) |
typedef actionlib::SimpleClientGoalState GS |
Definition at line 40 of file play_motion_test.cpp.
typedef play_motion_msgs::PlayMotionResult PMR |
Definition at line 41 of file play_motion_test.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 147 of file play_motion_test.cpp.
TEST | ( | PlayMotionTest | , |
basicReachPose | |||
) |
Definition at line 111 of file play_motion_test.cpp.
TEST | ( | PlayMotionTest | , |
rejectSecondGoal | |||
) |
Definition at line 122 of file play_motion_test.cpp.
TEST | ( | PlayMotionTest | , |
badMotionName | |||
) |
Definition at line 137 of file play_motion_test.cpp.