Template Class DummyActionServer

Class Documentation

template<class ActionT>
class DummyActionServer

Public Functions

inline explicit DummyActionServer(const rclcpp::Node::SharedPtr &node, std::string action_name)
virtual ~DummyActionServer() = default
inline void setFailureRanges(const Ranges &failureRanges)
inline void setRunningRanges(const Ranges &runningRanges)
inline void reset()
inline int getGoalCount() const

Protected Functions

inline virtual std::shared_ptr<typename ActionT::Result> fillResult()
inline virtual void updateResultForFailure(std::shared_ptr<typename ActionT::Result>&)
inline virtual void updateResultForSuccess(std::shared_ptr<typename ActionT::Result>&)
inline virtual rclcpp_action::GoalResponse handle_goal(const rclcpp_action::GoalUUID&, std::shared_ptr<const typename ActionT::Goal>)
inline virtual rclcpp_action::CancelResponse handle_cancel(const typename std::shared_ptr<rclcpp_action::ServerGoalHandle<ActionT>>)
inline void execute(const typename std::shared_ptr<rclcpp_action::ServerGoalHandle<ActionT>> goal_handle)
inline void handle_accepted(const std::shared_ptr<rclcpp_action::ServerGoalHandle<ActionT>> goal_handle)

Protected Attributes

rclcpp_action::Server<ActionT>::SharedPtr action_server_
std::string action_name_
Ranges failure_ranges_
Ranges running_ranges_
unsigned int goal_count_