14 #ifndef NAV2_WAYPOINT_FOLLOWER__PLUGINS__INPUT_AT_WAYPOINT_HPP_
15 #define NAV2_WAYPOINT_FOLLOWER__PLUGINS__INPUT_AT_WAYPOINT_HPP_
22 #include "rclcpp/rclcpp.hpp"
23 #include "std_msgs/msg/empty.hpp"
24 #include "rclcpp_lifecycle/lifecycle_node.hpp"
25 #include "nav2_core/waypoint_task_executor.hpp"
27 namespace nav2_waypoint_follower
55 const rclcpp_lifecycle::LifecycleNode::WeakPtr & parent,
56 const std::string & plugin_name);
65 const geometry_msgs::msg::PoseStamped & curr_pose,
const int & curr_waypoint_index);
72 void Cb(
const std_msgs::msg::Empty::SharedPtr msg);
76 rclcpp::Duration timeout_;
77 rclcpp::Logger logger_{rclcpp::get_logger(
"nav2_waypoint_follower")};
78 rclcpp::Clock::SharedPtr clock_;
80 rclcpp::Subscription<std_msgs::msg::Empty>::SharedPtr subscription_;
Base class for creating a plugin in order to perform a specific task at waypoint arrivals.