#include <gtest/gtest.h>
#include <gmock/gmock.h>
#include <ros/ros.h>
#include <mbf_abstract_core/abstract_controller.h>
#include <mbf_abstract_nav/MoveBaseFlexConfig.h>
#include <mbf_abstract_nav/abstract_controller_execution.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/TwistStamped.h>
#include <geometry_msgs/Twist.h>
#include <tf/transform_datatypes.h>
#include <geometry_msgs/TransformStamped.h>
#include <string>
#include <vector>
Go to the source code of this file.
Classes | |
struct | AbstractControllerExecutionFixture |
struct | AbstractControllerMock |
struct | ComputeRobotPoseFixture |
struct | FailureFixture |
Typedefs | |
typedef std::vector< PoseStamped > | plan_t |
Functions | |
ACTION (ControllerException) | |
int | main (int argc, char **argv) |
TEST_F (AbstractControllerExecutionFixture, emptyPlan) | |
TEST_F (AbstractControllerExecutionFixture, internalError) | |
TEST_F (AbstractControllerExecutionFixture, invalidPlan) | |
TEST_F (AbstractControllerExecutionFixture, noPlan) | |
TEST_F (ComputeRobotPoseFixture, arrivedGoal) | |
TEST_F (ComputeRobotPoseFixture, controllerException) | |
TEST_F (FailureFixture, maxRetries) | |
TEST_F (FailureFixture, noValidCmd) | |
TEST_F (FailureFixture, patExceeded) | |
Variables | |
ros::Publisher | GOAL_PUB |
TFPtr | TF_PTR |
ros::Publisher | VEL_PUB |
typedef std::vector<PoseStamped> plan_t |
Definition at line 32 of file test/abstract_controller_execution.cpp.
ACTION | ( | ControllerException | ) |
Definition at line 194 of file test/abstract_controller_execution.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 294 of file test/abstract_controller_execution.cpp.
TEST_F | ( | AbstractControllerExecutionFixture | , |
emptyPlan | |||
) |
Definition at line 81 of file test/abstract_controller_execution.cpp.
TEST_F | ( | AbstractControllerExecutionFixture | , |
internalError | |||
) |
Definition at line 117 of file test/abstract_controller_execution.cpp.
TEST_F | ( | AbstractControllerExecutionFixture | , |
invalidPlan | |||
) |
Definition at line 97 of file test/abstract_controller_execution.cpp.
TEST_F | ( | AbstractControllerExecutionFixture | , |
noPlan | |||
) |
Definition at line 68 of file test/abstract_controller_execution.cpp.
TEST_F | ( | ComputeRobotPoseFixture | , |
arrivedGoal | |||
) |
Definition at line 168 of file test/abstract_controller_execution.cpp.
TEST_F | ( | ComputeRobotPoseFixture | , |
controllerException | |||
) |
Definition at line 199 of file test/abstract_controller_execution.cpp.
TEST_F | ( | FailureFixture | , |
maxRetries | |||
) |
Definition at line 241 of file test/abstract_controller_execution.cpp.
TEST_F | ( | FailureFixture | , |
noValidCmd | |||
) |
Definition at line 262 of file test/abstract_controller_execution.cpp.
TEST_F | ( | FailureFixture | , |
patExceeded | |||
) |
Definition at line 277 of file test/abstract_controller_execution.cpp.
ros::Publisher GOAL_PUB |
Definition at line 44 of file test/abstract_controller_execution.cpp.
TFPtr TF_PTR |
Definition at line 45 of file test/abstract_controller_execution.cpp.
ros::Publisher VEL_PUB |
Definition at line 44 of file test/abstract_controller_execution.cpp.