Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes | List of all members
ActionTestBase< ACTION, TOPIC > Class Template Reference

#include <action_test_base.h>

Inheritance diagram for ActionTestBase< ACTION, TOPIC >:
Inheritance graph
[legend]

Public Member Functions

 ActionTestBase ()
 
void SetUp ()
 
 ~ActionTestBase ()
 

Protected Types

using ActionClient = actionlib::SimpleActionClient< ACTION >
 
using ActionClientPtr = std::shared_ptr< ActionClient >
 

Protected Member Functions

void cbStatus (const planner_cspace_msgs::PlannerStatus::ConstPtr &msg)
 
std::string statusString () const
 

Protected Attributes

bool map_ready_
 
ActionClientPtr move_base_
 
ros::NodeHandle node_
 
planner_cspace_msgs::PlannerStatus::ConstPtr planner_status_
 
ros::Subscriber sub_status_
 
tf2_ros::Buffer tfbuf_
 
tf2_ros::TransformListener tfl_
 

Detailed Description

template<typename ACTION, char const * TOPIC>
class ActionTestBase< ACTION, TOPIC >

Definition at line 51 of file action_test_base.h.

Member Typedef Documentation

◆ ActionClient

template<typename ACTION, char const * TOPIC>
using ActionTestBase< ACTION, TOPIC >::ActionClient = actionlib::SimpleActionClient<ACTION>
protected

Definition at line 105 of file action_test_base.h.

◆ ActionClientPtr

template<typename ACTION, char const * TOPIC>
using ActionTestBase< ACTION, TOPIC >::ActionClientPtr = std::shared_ptr<ActionClient>
protected

Definition at line 106 of file action_test_base.h.

Constructor & Destructor Documentation

◆ ActionTestBase()

template<typename ACTION, char const * TOPIC>
ActionTestBase< ACTION, TOPIC >::ActionTestBase ( )
inline

Definition at line 54 of file action_test_base.h.

◆ ~ActionTestBase()

template<typename ACTION, char const * TOPIC>
ActionTestBase< ACTION, TOPIC >::~ActionTestBase ( )
inline

Definition at line 100 of file action_test_base.h.

Member Function Documentation

◆ cbStatus()

template<typename ACTION, char const * TOPIC>
void ActionTestBase< ACTION, TOPIC >::cbStatus ( const planner_cspace_msgs::PlannerStatus::ConstPtr &  msg)
inlineprotected

Definition at line 108 of file action_test_base.h.

◆ SetUp()

template<typename ACTION, char const * TOPIC>
void ActionTestBase< ACTION, TOPIC >::SetUp ( )
inline

Definition at line 62 of file action_test_base.h.

◆ statusString()

template<typename ACTION, char const * TOPIC>
std::string ActionTestBase< ACTION, TOPIC >::statusString ( ) const
inlineprotected

Definition at line 113 of file action_test_base.h.

Member Data Documentation

◆ map_ready_

template<typename ACTION, char const * TOPIC>
bool ActionTestBase< ACTION, TOPIC >::map_ready_
protected

Definition at line 129 of file action_test_base.h.

◆ move_base_

template<typename ACTION, char const * TOPIC>
ActionClientPtr ActionTestBase< ACTION, TOPIC >::move_base_
protected

Definition at line 125 of file action_test_base.h.

◆ node_

template<typename ACTION, char const * TOPIC>
ros::NodeHandle ActionTestBase< ACTION, TOPIC >::node_
protected

Definition at line 123 of file action_test_base.h.

◆ planner_status_

template<typename ACTION, char const * TOPIC>
planner_cspace_msgs::PlannerStatus::ConstPtr ActionTestBase< ACTION, TOPIC >::planner_status_
protected

Definition at line 126 of file action_test_base.h.

◆ sub_status_

template<typename ACTION, char const * TOPIC>
ros::Subscriber ActionTestBase< ACTION, TOPIC >::sub_status_
protected

Definition at line 124 of file action_test_base.h.

◆ tfbuf_

template<typename ACTION, char const * TOPIC>
tf2_ros::Buffer ActionTestBase< ACTION, TOPIC >::tfbuf_
protected

Definition at line 127 of file action_test_base.h.

◆ tfl_

template<typename ACTION, char const * TOPIC>
tf2_ros::TransformListener ActionTestBase< ACTION, TOPIC >::tfl_
protected

Definition at line 128 of file action_test_base.h.


The documentation for this class was generated from the following file:


planner_cspace
Author(s): Atsushi Watanabe
autogenerated on Mon Jul 3 2023 02:39:06