Template Class DummyActionServer

Class Documentation

template<class ActionT>
class DummyActionServer

Public Functions

inline explicit DummyActionServer(const rclcpp::Node::SharedPtr &node, std::string action_name)
inline void setFailureRanges(const std::vector<std::pair<int, int>> &failureRanges)
inline void setRunningRanges(const std::vector<std::pair<int, int>> &runningRanges)
inline void reset()
inline int getGoalCount() const

Protected Functions

inline virtual std::shared_ptr<typename ActionT::Result> fillResult()
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_
std::vector<std::pair<int, int>> failure_ranges_
std::vector<std::pair<int, int>> running_ranges_
int goal_count_