#include <gtest/gtest.h>
#include <ros/ros.h>
#include <actionlib/TestRequestAction.h>
#include <actionlib/TestRequestGoal.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib_msgs/GoalStatus.h>
Go to the source code of this file.
Classes | |
class | SimpleClientFixture |
Defines | |
#define | EXPECT_STATE(expected_state) |
Functions | |
int | main (int argc, char **argv) |
void | spinThread () |
TEST_F (SimpleClientFixture, just_succeed) | |
TEST_F (SimpleClientFixture, just_abort) | |
TEST_F (SimpleClientFixture, just_preempt) | |
TEST_F (SimpleClientFixture, drop) | |
TEST_F (SimpleClientFixture, exception) | |
TEST_F (SimpleClientFixture, ignore_cancel_and_succeed) | |
TEST_F (SimpleClientFixture, lose) |
#define EXPECT_STATE | ( | expected_state | ) |
EXPECT_TRUE( ac_.getState() == SimpleClientGoalState::expected_state) \ << "Expected [" << #expected_state << "], but goal state is [" << ac_.getState().toString() << "]";
Definition at line 40 of file exercise_simple_client.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 170 of file exercise_simple_client.cpp.
void spinThread | ( | ) |
Definition at line 164 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
just_succeed | |||
) |
Definition at line 63 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
just_abort | |||
) |
Definition at line 74 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
just_preempt | |||
) |
Definition at line 85 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
drop | |||
) |
Definition at line 108 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
exception | |||
) |
Definition at line 119 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
ignore_cancel_and_succeed | |||
) |
Definition at line 130 of file exercise_simple_client.cpp.
TEST_F | ( | SimpleClientFixture | , |
lose | |||
) |
Definition at line 154 of file exercise_simple_client.cpp.