File tree Expand file tree Collapse file tree 1 file changed +5
-0
lines changed
nav2_behavior_tree/include/nav2_behavior_tree Expand file tree Collapse file tree 1 file changed +5
-0
lines changed Original file line number Diff line number Diff line change @@ -186,6 +186,11 @@ bool BtActionServer<ActionT>::loadBehaviorTree(const std::string & bt_xml_filena
186186 // Create the Behavior Tree from the XML input
187187 try {
188188 tree_ = bt_->createTreeFromText (xml_string, blackboard_);
189+ for (auto & blackboard : tree_.blackboard_stack ) {
190+ blackboard->set <rclcpp::Node::SharedPtr>(" node" , client_node_);
191+ blackboard->set <std::chrono::milliseconds>(" server_timeout" , default_server_timeout_);
192+ blackboard->set <std::chrono::milliseconds>(" bt_loop_duration" , bt_loop_duration_);
193+ }
189194 } catch (const std::exception & e) {
190195 RCLCPP_ERROR (logger_, " Exception when loading BT: %s" , e.what ());
191196 return false ;
You can’t perform that action at this time.
0 commit comments