15 #ifndef NAV2_CORE__BEHAVIOR_TREE_NAVIGATOR_HPP_
16 #define NAV2_CORE__BEHAVIOR_TREE_NAVIGATOR_HPP_
23 #include "nav2_util/odometry_utils.hpp"
24 #include "tf2_ros/buffer.hpp"
25 #include "rclcpp/rclcpp.hpp"
26 #include "nav2_ros_common/lifecycle_node.hpp"
27 #include "pluginlib/class_loader.hpp"
28 #include "nav2_behavior_tree/bt_action_server.hpp"
39 std::string robot_frame;
40 std::string global_frame;
41 double transform_tolerance;
42 std::shared_ptr<tf2_ros::Buffer> tf;
57 : current_navigator_(std::string(
"")) {}
65 std::scoped_lock l(mutex_);
66 return !current_navigator_.empty();
75 std::scoped_lock l(mutex_);
76 if (!current_navigator_.empty()) {
78 rclcpp::get_logger(
"NavigatorMutex"),
79 "Major error! Navigation requested while another navigation"
80 " task is in progress! This likely occurred from an incorrect"
81 "implementation of a navigator plugin.");
83 current_navigator_ = navigator_name;
92 std::scoped_lock l(mutex_);
93 if (current_navigator_ != navigator_name) {
95 rclcpp::get_logger(
"NavigatorMutex"),
96 "Major error! Navigation stopped while another navigation"
97 " task is in progress! This likely occurred from an incorrect"
98 "implementation of a navigator plugin.");
100 current_navigator_ = std::string(
"");
105 std::string current_navigator_;
127 nav2::LifecycleNode::WeakPtr parent_node,
128 const std::vector<std::string> & plugin_lib_names,
131 std::shared_ptr<nav2_util::OdomSmoother> odom_smoother) = 0;
158 template<
class ActionT>
162 using Ptr = std::shared_ptr<nav2_core::BehaviorTreeNavigator<ActionT>>;
170 plugin_muxer_ =
nullptr;
189 nav2::LifecycleNode::WeakPtr parent_node,
190 const std::vector<std::string> & plugin_lib_names,
193 std::shared_ptr<nav2_util::OdomSmoother> odom_smoother)
final
195 auto node = parent_node.lock();
196 logger_ = node->get_logger();
197 clock_ = node->get_clock();
198 feedback_utils_ = feedback_utils;
199 plugin_muxer_ = plugin_muxer;
202 std::string default_bt_xml_filename = getDefaultBTFilepath(parent_node);
206 std::make_unique<nav2_behavior_tree::BtActionServer<ActionT, nav2::LifecycleNode>>(
210 default_bt_xml_filename,
216 std::placeholders::_1, std::placeholders::_2));
219 if (!bt_action_server_->on_configure()) {
223 BT::Blackboard::Ptr blackboard = bt_action_server_->getBlackboard();
224 blackboard->set(
"tf_buffer", feedback_utils.tf);
225 blackboard->set(
"initial_pose_received",
false);
226 blackboard->set(
"number_recoveries", 0);
227 blackboard->set(
"odom_smoother", odom_smoother);
229 return configure(parent_node, odom_smoother) && ok;
240 if (!bt_action_server_->on_activate()) {
254 if (!bt_action_server_->on_deactivate()) {
268 if (!bt_action_server_->on_cleanup()) {
272 bt_action_server_.reset();
277 virtual std::string getDefaultBTFilepath(nav2::LifecycleNode::WeakPtr node) = 0;
294 "Requested navigation from %s while another navigator is processing,"
295 " rejecting request.",
getName().c_str());
305 return goal_accepted;
312 typename ActionT::Result::SharedPtr result,
313 const nav2_behavior_tree::BtStatus final_bt_status)
324 virtual bool goalReceived(
typename ActionT::Goal::ConstSharedPtr goal) = 0;
335 virtual void onPreempt(
typename ActionT::Goal::ConstSharedPtr goal) = 0;
342 typename ActionT::Result::SharedPtr result,
343 const nav2_behavior_tree::BtStatus final_bt_status) = 0;
349 nav2::LifecycleNode::WeakPtr ,
350 std::shared_ptr<nav2_util::OdomSmoother>)
370 std::unique_ptr<nav2_behavior_tree::BtActionServer<ActionT, nav2::LifecycleNode>>
372 rclcpp::Logger logger_{rclcpp::get_logger(
"Navigator")};
373 rclcpp::Clock::SharedPtr clock_;
374 FeedbackUtils feedback_utils_;
375 NavigatorMuxer * plugin_muxer_;
Navigator interface that acts as a base class for all BT-based Navigator action's plugins All methods...
virtual void goalCompleted(typename ActionT::Result::SharedPtr result, const nav2_behavior_tree::BtStatus final_bt_status)=0
A callback that is called when a the action is completed; Can fill in action result message or indica...
virtual void onPreempt(typename ActionT::Goal::ConstSharedPtr goal)=0
A callback that is called when a preempt is requested.
BehaviorTreeNavigator()
A Navigator constructor.
virtual ~BehaviorTreeNavigator()=default
Virtual destructor.
virtual std::string getName()=0
Get the action name of this navigator to expose.
bool onGoalReceived(typename ActionT::Goal::ConstSharedPtr goal)
An intermediate goal reception function to mux navigators.
bool on_cleanup() final
Cleanup a navigator.
void onCompletion(typename ActionT::Result::SharedPtr result, const nav2_behavior_tree::BtStatus final_bt_status)
An intermediate completion function to mux navigators.
virtual bool deactivate()
Method to deactivate and any threads involved in execution.
virtual void onLoop()=0
A callback that defines execution that happens on one iteration through the BT Can be used to publish...
virtual bool activate()
Method to activate any threads involved in execution.
bool on_deactivate() final
Deactivation of the navigator's backend BT and actions.
virtual bool cleanup()
Method to cleanup resources.
virtual bool configure(nav2::LifecycleNode::WeakPtr, std::shared_ptr< nav2_util::OdomSmoother >)
virtual bool goalReceived(typename ActionT::Goal::ConstSharedPtr goal)=0
A callback to be called when a new goal is received by the BT action server Can be used to check if g...
bool on_activate() final
Activation of the navigator's backend BT and actions.
bool on_configure(nav2::LifecycleNode::WeakPtr parent_node, const std::vector< std::string > &plugin_lib_names, const FeedbackUtils &feedback_utils, nav2_core::NavigatorMuxer *plugin_muxer, std::shared_ptr< nav2_util::OdomSmoother > odom_smoother) final
Configuration to setup the navigator's backend BT and actions.
Navigator interface to allow navigators to be stored in a vector and accessed via pluginlib due to te...
virtual bool on_cleanup()=0
Cleanup a navigator.
virtual bool on_deactivate()=0
Deactivation of the navigator's backend BT and actions.
virtual bool on_activate()=0
Activation of the navigator's backend BT and actions.
virtual bool on_configure(nav2::LifecycleNode::WeakPtr parent_node, const std::vector< std::string > &plugin_lib_names, const FeedbackUtils &feedback_utils, nav2_core::NavigatorMuxer *plugin_muxer, std::shared_ptr< nav2_util::OdomSmoother > odom_smoother)=0
Configuration of the navigator's backend BT and actions.
A class to control the state of the BT navigator by allowing only a single plugin to be processed at ...
void startNavigating(const std::string &navigator_name)
Start navigating with a given navigator.
void stopNavigating(const std::string &navigator_name)
Stop navigating with a given navigator.
bool isNavigating()
Get the navigator muxer state.
NavigatorMuxer()
A Navigator Muxer constructor.
Navigator feedback utilities required to get transforms and reference frames.