xml_parsing.cpp
Go to the documentation of this file.
1 /* Copyright (C) 2018-2020 Davide Faconti, Eurecat - All Rights Reserved
2 *
3 * Permission is hereby granted, free of charge, to any person obtaining a copy of this software and associated documentation files (the "Software"),
4 * to deal in the Software without restriction, including without limitation the rights to use, copy, modify, merge, publish, distribute, sublicense,
5 * and/or sell copies of the Software, and to permit persons to whom the Software is furnished to do so, subject to the following conditions:
6 * The above copyright notice and this permission notice shall be included in all copies or substantial portions of the Software.
7 *
8 * THE SOFTWARE IS PROVIDED "AS IS", WITHOUT WARRANTY OF ANY KIND, EXPRESS OR IMPLIED, INCLUDING BUT NOT LIMITED TO THE WARRANTIES OF MERCHANTABILITY,
9 * FITNESS FOR A PARTICULAR PURPOSE AND NONINFRINGEMENT. IN NO EVENT SHALL THE AUTHORS OR COPYRIGHT HOLDERS BE LIABLE FOR ANY CLAIM, DAMAGES OR OTHER LIABILITY,
10 * WHETHER IN AN ACTION OF CONTRACT, TORT OR OTHERWISE, ARISING FROM, OUT OF OR IN CONNECTION WITH THE SOFTWARE OR THE USE OR OTHER DEALINGS IN THE SOFTWARE.
11 */
12 
13 #include <functional>
14 #include <list>
15 
16 #if defined(__linux) || defined(__linux__)
17 #pragma GCC diagnostic push
18 #pragma GCC diagnostic ignored "-Wattributes"
19 #endif
20 
21 #ifdef _MSC_VER
22 #pragma warning(disable : 4996) // do not complain about sprintf
23 #endif
24 
25 #include <map>
27 #include "tinyxml2/tinyxml2.h"
28 #include "filesystem/path.h"
29 
30 #ifdef USING_ROS
31 #include <ros/package.h>
32 #endif
33 
34 #ifdef USING_ROS2
35 #include <ament_index_cpp/get_package_share_directory.hpp>
36 #endif
37 
40 
41 namespace BT
42 {
43 using namespace tinyxml2;
44 
45 auto StrEqual = [](const char* str1, const char* str2) -> bool {
46  return strcmp(str1, str2) == 0;
47 };
48 
50 {
51  TreeNode::Ptr createNodeFromXML(const XMLElement* element,
52  const Blackboard::Ptr& blackboard,
53  const TreeNode::Ptr& node_parent);
54 
55  void recursivelyCreateTree(const std::string& tree_ID, Tree& output_tree,
56  Blackboard::Ptr blackboard,
57  const TreeNode::Ptr& root_parent);
58 
59  void getPortsRecursively(const XMLElement* element,
60  std::vector<std::string>& output_ports);
61 
62  void loadDocImpl(tinyxml2::XMLDocument* doc, bool add_includes);
63 
64  std::list<std::unique_ptr<tinyxml2::XMLDocument> > opened_documents;
65  std::map<std::string, const XMLElement*> tree_roots;
66 
68 
69  filesystem::path current_path;
70 
72 
73  explicit Pimpl(const BehaviorTreeFactory& fact) :
74  factory(fact), current_path(filesystem::path::getcwd()), suffix_count(0)
75  {}
76 
77  void clear()
78  {
79  suffix_count = 0;
80  current_path = filesystem::path::getcwd();
81  opened_documents.clear();
82  tree_roots.clear();
83  }
84 };
85 
86 #if defined(__linux) || defined(__linux__)
87 #pragma GCC diagnostic pop
88 #endif
89 
90 XMLParser::XMLParser(const BehaviorTreeFactory& factory) : _p(new Pimpl(factory))
91 {}
92 
94 {
95  delete _p;
96 }
97 
98 void XMLParser::loadFromFile(const std::string& filename, bool add_includes)
99 {
100  _p->opened_documents.emplace_back(new tinyxml2::XMLDocument());
101 
102  tinyxml2::XMLDocument* doc = _p->opened_documents.back().get();
103  doc->LoadFile(filename.c_str());
104 
105  filesystem::path file_path(filename);
106  _p->current_path = file_path.parent_path().make_absolute();
107 
108  _p->loadDocImpl(doc, add_includes);
109 }
110 
111 void XMLParser::loadFromText(const std::string& xml_text, bool add_includes)
112 {
113  _p->opened_documents.emplace_back(new tinyxml2::XMLDocument());
114 
115  tinyxml2::XMLDocument* doc = _p->opened_documents.back().get();
116  doc->Parse(xml_text.c_str(), xml_text.size());
117 
118  _p->loadDocImpl(doc, add_includes);
119 }
120 
121 std::vector<std::string> XMLParser::registeredBehaviorTrees() const
122 {
123  std::vector<std::string> out;
124  for (const auto& it : _p->tree_roots)
125  {
126  out.push_back(it.first);
127  }
128  return out;
129 }
130 
132 {
133  if (doc->Error())
134  {
135  char buffer[200];
136  sprintf(buffer, "Error parsing the XML: %s", doc->ErrorName());
137  throw RuntimeError(buffer);
138  }
139 
140  const XMLElement* xml_root = doc->RootElement();
141 
142  // recursively include other files
143  for (auto include_node = xml_root->FirstChildElement("include");
144  include_node != nullptr; include_node = include_node->NextSiblingElement("includ"
145  "e"))
146  {
147  if (!add_includes)
148  {
149  break;
150  }
151 
152  filesystem::path file_path(include_node->Attribute("path"));
153  const char* ros_pkg_relative_path = include_node->Attribute("ros_pkg");
154 
155  if (ros_pkg_relative_path)
156  {
157  if (file_path.is_absolute())
158  {
159  std::cout << "WARNING: <include path=\"...\"> contains an absolute "
160  "path.\n"
161  << "Attribute [ros_pkg] will be ignored." << std::endl;
162  }
163  else
164  {
165  std::string ros_pkg_path;
166 #ifdef USING_ROS
167  ros_pkg_path = ros::package::getPath(ros_pkg_relative_path);
168  file_path = filesystem::path(ros_pkg_path) / file_path;
169 #elif defined USING_ROS2
170  ros_pkg_path =
171  ament_index_cpp::get_package_share_directory(ros_pkg_relative_path);
172  file_path = filesystem::path(ros_pkg_path) / file_path;
173 #else
174  throw RuntimeError("Using attribute [ros_pkg] in <include>, but this "
175  "library was "
176  "compiled "
177  "without ROS support. Recompile the BehaviorTree.CPP "
178  "using "
179  "catkin");
180 #endif
181  }
182  }
183 
184  if (!file_path.is_absolute())
185  {
186  file_path = current_path / file_path;
187  }
188 
189  opened_documents.emplace_back(new tinyxml2::XMLDocument());
190  tinyxml2::XMLDocument* next_doc = opened_documents.back().get();
191 
192  // change current path to the included file for handling additional relative paths
193  const filesystem::path previous_path = current_path;
194  current_path = file_path.parent_path().make_absolute();
195 
196  next_doc->LoadFile(file_path.str().c_str());
197  loadDocImpl(next_doc, add_includes);
198 
199  // reset current path to the previous value
200  current_path = previous_path;
201  }
202 
203  // Collect the names of all nodes registered with the behavior tree factory
204  std::unordered_map<std::string, BT::NodeType> registered_nodes;
205  for (const auto& it : factory.manifests())
206  {
207  registered_nodes.insert({it.first, it.second.type});
208  }
209 
210  XMLPrinter printer;
211  doc->Print(&printer);
212  auto xml_text = std::string(printer.CStr(), size_t(printer.CStrSize() - 1));
213 
214  // Verify the validity of the XML before adding any behavior trees to the parser's list of registered trees
215  VerifyXML(xml_text, registered_nodes);
216 
217  // Register each BehaviorTree within the XML
218  for (auto bt_node = xml_root->FirstChildElement("BehaviorTree"); bt_node != nullptr;
219  bt_node = bt_node->NextSiblingElement("BehaviorTree"))
220  {
221  std::string tree_name;
222  if (bt_node->Attribute("ID"))
223  {
224  tree_name = bt_node->Attribute("ID");
225  }
226  else
227  {
228  tree_name = "BehaviorTree_" + std::to_string(suffix_count++);
229  }
230 
231  tree_roots.insert({tree_name, bt_node});
232  }
233 }
234 
235 void VerifyXML(const std::string& xml_text,
236  const std::unordered_map<std::string, BT::NodeType>& registered_nodes)
237 {
239  auto xml_error = doc.Parse(xml_text.c_str(), xml_text.size());
240  if (xml_error)
241  {
242  char buffer[200];
243  sprintf(buffer, "Error parsing the XML: %s", doc.ErrorName());
244  throw RuntimeError(buffer);
245  }
246 
247  //-------- Helper functions (lambdas) -----------------
248  auto ThrowError = [&](int line_num, const std::string& text) {
249  char buffer[256];
250  sprintf(buffer, "Error at line %d: -> %s", line_num, text.c_str());
251  throw RuntimeError(buffer);
252  };
253 
254  auto ChildrenCount = [](const XMLElement* parent_node) {
255  int count = 0;
256  for (auto node = parent_node->FirstChildElement(); node != nullptr;
257  node = node->NextSiblingElement())
258  {
259  count++;
260  }
261  return count;
262  };
263  //-----------------------------
264 
265  const XMLElement* xml_root = doc.RootElement();
266 
267  if (!xml_root || !StrEqual(xml_root->Name(), "root"))
268  {
269  throw RuntimeError("The XML must have a root node called <root>");
270  }
271  //-------------------------------------------------
272  auto models_root = xml_root->FirstChildElement("TreeNodesModel");
273  auto meta_sibling =
274  models_root ? models_root->NextSiblingElement("TreeNodesModel") : nullptr;
275 
276  if (meta_sibling)
277  {
278  ThrowError(meta_sibling->GetLineNum(), " Only a single node <TreeNodesModel> is "
279  "supported");
280  }
281  if (models_root)
282  {
283  // not having a MetaModel is not an error. But consider that the
284  // Graphical editor needs it.
285  for (auto node = xml_root->FirstChildElement(); node != nullptr;
286  node = node->NextSiblingElement())
287  {
288  const char* name = node->Name();
289  if (StrEqual(name, "Action") || StrEqual(name, "Decorator") ||
290  StrEqual(name, "SubTree") || StrEqual(name, "Condition") ||
291  StrEqual(name, "Control"))
292  {
293  const char* ID = node->Attribute("ID");
294  if (!ID)
295  {
296  ThrowError(node->GetLineNum(), "Error at line %d: -> The attribute "
297  "[ID] is "
298  "mandatory");
299  }
300  }
301  }
302  }
303  //-------------------------------------------------
304 
305  // function to be called recursively
306  std::function<void(const XMLElement*)> recursiveStep;
307 
308  recursiveStep = [&](const XMLElement* node) {
309  const int children_count = ChildrenCount(node);
310  const char* name = node->Name();
311  if (StrEqual(name, "Decorator"))
312  {
313  if (children_count != 1)
314  {
315  ThrowError(node->GetLineNum(), "The node <Decorator> must have exactly 1 "
316  "child");
317  }
318  if (!node->Attribute("ID"))
319  {
320  ThrowError(node->GetLineNum(), "The node <Decorator> must have the "
321  "attribute [ID]");
322  }
323  }
324  else if (StrEqual(name, "Action"))
325  {
326  if (children_count != 0)
327  {
328  ThrowError(node->GetLineNum(), "The node <Action> must not have any "
329  "child");
330  }
331  if (!node->Attribute("ID"))
332  {
333  ThrowError(node->GetLineNum(), "The node <Action> must have the "
334  "attribute [ID]");
335  }
336  }
337  else if (StrEqual(name, "Condition"))
338  {
339  if (children_count != 0)
340  {
341  ThrowError(node->GetLineNum(), "The node <Condition> must not have any "
342  "child");
343  }
344  if (!node->Attribute("ID"))
345  {
346  ThrowError(node->GetLineNum(), "The node <Condition> must have the "
347  "attribute [ID]");
348  }
349  }
350  else if (StrEqual(name, "Control"))
351  {
352  if (children_count == 0)
353  {
354  ThrowError(node->GetLineNum(), "The node <Control> must have at least 1 "
355  "child");
356  }
357  if (!node->Attribute("ID"))
358  {
359  ThrowError(node->GetLineNum(), "The node <Control> must have the "
360  "attribute [ID]");
361  }
362  }
363  else if (StrEqual(name, "Sequence") || StrEqual(name, "SequenceStar") ||
364  StrEqual(name, "Fallback"))
365  {
366  if (children_count == 0)
367  {
368  ThrowError(node->GetLineNum(), "A Control node must have at least 1 "
369  "child");
370  }
371  }
372  else if (StrEqual(name, "SubTree"))
373  {
374  auto child = node->FirstChildElement();
375 
376  if (child)
377  {
378  if (StrEqual(child->Name(), "remap"))
379  {
380  ThrowError(node->GetLineNum(), "<remap> was deprecated");
381  }
382  else
383  {
384  ThrowError(node->GetLineNum(), "<SubTree> should not have any child");
385  }
386  }
387 
388  if (!node->Attribute("ID"))
389  {
390  ThrowError(node->GetLineNum(), "The node <SubTree> must have the "
391  "attribute [ID]");
392  }
393  }
394  else if (StrEqual(name, "BehaviorTree"))
395  {
396  if (children_count != 1)
397  {
398  ThrowError(node->GetLineNum(), "The node <BehaviorTree> must have exactly 1 "
399  "child");
400  }
401  }
402  else
403  {
404  // search in the factory and the list of subtrees
405  const auto search = registered_nodes.find(name);
406  bool found = (search != registered_nodes.end());
407  if (!found)
408  {
409  ThrowError(node->GetLineNum(), std::string("Node not recognized: ") + name);
410  }
411 
412  if (search->second == NodeType::DECORATOR)
413  {
414  if (children_count != 1)
415  {
416  ThrowError(node->GetLineNum(),
417  std::string("The node <") + name + "> must have exactly 1 child");
418  }
419  }
420  }
421  //recursion
422  if (StrEqual(name, "SubTree") == false)
423  {
424  for (auto child = node->FirstChildElement(); child != nullptr;
425  child = child->NextSiblingElement())
426  {
427  recursiveStep(child);
428  }
429  }
430  };
431 
432  for (auto bt_root = xml_root->FirstChildElement("BehaviorTree"); bt_root != nullptr;
433  bt_root = bt_root->NextSiblingElement("BehaviorTree"))
434  {
435  recursiveStep(bt_root);
436  }
437 }
438 
440  std::string main_tree_to_execute)
441 {
442  Tree output_tree;
443  std::string main_tree_ID = main_tree_to_execute;
444 
445  // use the main_tree_to_execute argument if it was provided by the user
446  // or the one in the FIRST document opened
447  if (main_tree_ID.empty())
448  {
449  XMLElement* first_xml_root = _p->opened_documents.front()->RootElement();
450 
451  if (auto main_tree_attribute = first_xml_root->Attribute("main_tree_to_execute"))
452  {
453  main_tree_ID = main_tree_attribute;
454  }
455  else if (_p->tree_roots.size() == 1)
456  {
457  // special case: there is only one registered BT.
458  main_tree_ID = _p->tree_roots.begin()->first;
459  }
460  else
461  {
462  throw RuntimeError("[main_tree_to_execute] was not specified correctly");
463  }
464  }
465 
466  //--------------------------------------
467  if (!root_blackboard)
468  {
469  throw RuntimeError("XMLParser::instantiateTree needs a non-empty "
470  "root_blackboard");
471  }
472  // first blackboard
473  output_tree.blackboard_stack.push_back(root_blackboard);
474 
475  _p->recursivelyCreateTree(main_tree_ID, output_tree, root_blackboard, TreeNode::Ptr());
476  output_tree.initialize();
477  return output_tree;
478 }
479 
481 {
482  _p->clear();
483 }
484 
486  const Blackboard::Ptr& blackboard,
487  const TreeNode::Ptr& node_parent)
488 {
489  const std::string element_name = element->Name();
490  std::string ID;
491  std::string instance_name;
492 
493  // Actions and Decorators have their own ID
494  if (element_name == "Action" || element_name == "Decorator" ||
495  element_name == "Condition" || element_name == "Control")
496  {
497  ID = element->Attribute("ID");
498  }
499  else
500  {
501  ID = element_name;
502  }
503 
504  const char* attr_alias = element->Attribute("name");
505  if (attr_alias)
506  {
507  instance_name = attr_alias;
508  }
509  else
510  {
511  instance_name = ID;
512  }
513 
514  PortsRemapping port_remap;
515 
516  if (element_name == "SubTree" || element_name == "SubTreePlus")
517  {
518  instance_name = element->Attribute("ID");
519  }
520  else
521  {
522  // do this only if it NOT a Subtree
523  for (const XMLAttribute* att = element->FirstAttribute(); att; att = att->Next())
524  {
525  const std::string attribute_name = att->Name();
526  if (ReservedPortNames.count(attribute_name) == 0)
527  {
528  port_remap[attribute_name] = att->Value();
529  }
530  }
531  }
532  NodeConfiguration config;
533  config.blackboard = blackboard;
534 
535  //---------------------------------------------
536  TreeNode::Ptr child_node;
537 
538  if (factory.builders().count(ID) != 0)
539  {
540  const auto& manifest = factory.manifests().at(ID);
541 
542  //Check that name in remapping can be found in the manifest
543  for (const auto& remap_it : port_remap)
544  {
545  if (manifest.ports.count(remap_it.first) == 0)
546  {
547  throw RuntimeError("Possible typo? In the XML, you tried to remap port "
548  "\"",
549  remap_it.first, "\" in node [", ID, " / ", instance_name,
550  "], but the manifest of this node does not contain a "
551  "port with "
552  "this name.");
553  }
554  }
555 
556  // Initialize the ports in the BB to set the type
557  for (const auto& port_it : manifest.ports)
558  {
559  const std::string& port_name = port_it.first;
560  const auto& port_info = port_it.second;
561 
562  auto remap_it = port_remap.find(port_name);
563  if (remap_it == port_remap.end())
564  {
565  continue;
566  }
567  StringView param_value = remap_it->second;
568  auto param_res = TreeNode::getRemappedKey(port_name, param_value);
569  if (param_res)
570  {
571  const auto port_key = static_cast<std::string>(param_res.value());
572 
573  auto prev_info = blackboard->portInfo(port_key);
574  if (!prev_info)
575  {
576  // not found, insert for the first time.
577  blackboard->createEntry(port_key, port_info);
578  }
579  else
580  {
581  // found. check consistency
582  if (prev_info->type() &&
583  port_info.type() && // null type means that everything is valid
584  *prev_info->type() != *port_info.type())
585  {
586  blackboard->debugMessage();
587 
588  throw RuntimeError("The creation of the tree failed because the port [",
589  port_key, "] was initially created with type [",
590  demangle(prev_info->type()), "] and, later type [",
591  demangle(port_info.type()), "] was used somewhere else.");
592  }
593  }
594  }
595  }
596 
597  // use manifest to initialize NodeConfiguration
598  for (const auto& remap_it : port_remap)
599  {
600  const auto& port_name = remap_it.first;
601  auto port_it = manifest.ports.find(port_name);
602  if (port_it != manifest.ports.end())
603  {
604  auto direction = port_it->second.direction();
605  if (direction != PortDirection::OUTPUT)
606  {
607  config.input_ports.insert(remap_it);
608  }
609  if (direction != PortDirection::INPUT)
610  {
611  config.output_ports.insert(remap_it);
612  }
613  }
614  }
615 
616  // use default value if available for empty ports. Only inputs
617  for (const auto& port_it : manifest.ports)
618  {
619  const std::string& port_name = port_it.first;
620  const PortInfo& port_info = port_it.second;
621 
622  auto direction = port_info.direction();
623  if (direction != PortDirection::OUTPUT &&
624  config.input_ports.count(port_name) == 0 &&
625  port_info.defaultValue().empty() == false)
626  {
627  config.input_ports.insert({port_name, port_info.defaultValue()});
628  }
629  }
630 
631  child_node = factory.instantiateTreeNode(instance_name, ID, config);
632  }
633  else if (tree_roots.count(ID) != 0)
634  {
635  child_node = std::make_unique<SubtreeNode>(instance_name);
636  }
637  else
638  {
639  throw RuntimeError(ID, " is not a registered node, nor a Subtree");
640  }
641 
642  if (node_parent)
643  {
644  if (auto control_parent = dynamic_cast<ControlNode*>(node_parent.get()))
645  {
646  control_parent->addChild(child_node.get());
647  }
648  if (auto decorator_parent = dynamic_cast<DecoratorNode*>(node_parent.get()))
649  {
650  decorator_parent->setChild(child_node.get());
651  }
652  }
653  return child_node;
654 }
655 
656 void BT::XMLParser::Pimpl::recursivelyCreateTree(const std::string& tree_ID,
657  Tree& output_tree,
658  Blackboard::Ptr blackboard,
659  const TreeNode::Ptr& root_parent)
660 {
661  std::function<void(const TreeNode::Ptr&, const XMLElement*)> recursiveStep;
662 
663  recursiveStep = [&](const TreeNode::Ptr& parent, const XMLElement* element) {
664  // create the node
665  auto node = createNodeFromXML(element, blackboard, parent);
666  output_tree.nodes.push_back(node);
667 
668  if (node->type() == NodeType::SUBTREE)
669  {
670  if (dynamic_cast<const SubtreeNode*>(node.get()))
671  {
672  bool is_isolated = true;
673 
674  for (const XMLAttribute* attr = element->FirstAttribute(); attr != nullptr;
675  attr = attr->Next())
676  {
677  if (StrEqual(attr->Name(), "__shared_blackboard"))
678  {
679  is_isolated = !convertFromString<bool>(attr->Value());
680  break;
681  }
682  }
683 
684  if (!is_isolated)
685  {
686  recursivelyCreateTree(node->name(), output_tree, blackboard, node);
687  }
688  else
689  {
690  // Creating an isolated
691  auto new_bb = Blackboard::create(blackboard);
692 
693  for (const XMLAttribute* attr = element->FirstAttribute(); attr != nullptr;
694  attr = attr->Next())
695  {
696  if (ReservedPortNames.count(attr->Name()) == 0)
697  {
698  new_bb->addSubtreeRemapping(attr->Name(), attr->Value());
699  }
700  }
701  output_tree.blackboard_stack.emplace_back(new_bb);
702  recursivelyCreateTree(node->name(), output_tree, new_bb, node);
703  }
704  }
705  else if (dynamic_cast<const SubtreePlusNode*>(node.get()))
706  {
707  auto new_bb = Blackboard::create(blackboard);
708  output_tree.blackboard_stack.emplace_back(new_bb);
709  std::set<StringView> mapped_keys;
710 
711  for (const XMLAttribute* attr = element->FirstAttribute(); attr != nullptr;
712  attr = attr->Next())
713  {
714  const char* attr_name = attr->Name();
715  const char* attr_value = attr->Value();
716 
717  if (ReservedPortNames.count(attr->Name()) != 0)
718  {
719  continue;
720  }
721  if (StrEqual(attr_name, "__autoremap"))
722  {
723  bool do_autoremap = convertFromString<bool>(attr_value);
724  new_bb->enableAutoRemapping(do_autoremap);
725  continue;
726  }
727 
728  if (TreeNode::isBlackboardPointer(attr_value))
729  {
730  // do remapping
731  StringView port_name = TreeNode::stripBlackboardPointer(attr_value);
732  new_bb->addSubtreeRemapping(attr_name, port_name);
733  mapped_keys.insert(attr_name);
734  }
735  else
736  {
737  // constant string: just set that constant value into the BB
738  new_bb->set(attr_name, static_cast<std::string>(attr_value));
739  mapped_keys.insert(attr_name);
740  }
741  }
742 
743  recursivelyCreateTree(node->name(), output_tree, new_bb, node);
744  }
745  }
746  else
747  {
748  for (auto child_element = element->FirstChildElement(); child_element;
749  child_element = child_element->NextSiblingElement())
750  {
751  recursiveStep(node, child_element);
752  }
753  }
754  };
755 
756  auto it = tree_roots.find(tree_ID);
757  if (it == tree_roots.end())
758  {
759  throw std::runtime_error(std::string("Can't find a tree with name: ") + tree_ID);
760  }
761 
762  auto root_element = it->second->FirstChildElement();
763 
764  // start recursion
765  recursiveStep(root_parent, root_element);
766 }
767 
769  std::vector<std::string>& output_ports)
770 {
771  for (const XMLAttribute* attr = element->FirstAttribute(); attr != nullptr;
772  attr = attr->Next())
773  {
774  const char* attr_name = attr->Name();
775  const char* attr_value = attr->Value();
776  if (ReservedPortNames.count(attr_name) == 0 &&
777  TreeNode::isBlackboardPointer(attr_value))
778  {
779  auto port_name = TreeNode::stripBlackboardPointer(attr_value);
780  output_ports.push_back(static_cast<std::string>(port_name));
781  }
782  }
783 
784  for (auto child_element = element->FirstChildElement(); child_element;
785  child_element = child_element->NextSiblingElement())
786  {
787  getPortsRecursively(child_element, output_ports);
788  }
789 }
790 
791 std::string writeTreeNodesModelXML(const BehaviorTreeFactory& factory,
792  bool include_builtin)
793 {
794  XMLDocument doc;
795 
796  XMLElement* rootXML = doc.NewElement("root");
797  doc.InsertFirstChild(rootXML);
798 
799  XMLElement* model_root = doc.NewElement("TreeNodesModel");
800  rootXML->InsertEndChild(model_root);
801 
802  std::set<std::string> ordered_names;
803 
804  for (auto& model_it : factory.manifests())
805  {
806  const auto& registration_ID = model_it.first;
807  if (!include_builtin && factory.builtinNodes().count(registration_ID) != 0)
808  {
809  continue;
810  }
811  ordered_names.insert(registration_ID);
812  }
813 
814  for (auto& registration_ID : ordered_names)
815  {
816  const auto& model = factory.manifests().at(registration_ID);
817 
818  XMLElement* element = doc.NewElement(toStr(model.type).c_str());
819  element->SetAttribute("ID", model.registration_ID.c_str());
820 
821  std::vector<std::string> ordered_ports;
824  for (int d = 0; d < 3; d++)
825  {
826  std::set<std::string> port_names;
827  for (auto& port : model.ports)
828  {
829  const auto& port_name = port.first;
830  const auto& port_info = port.second;
831  if (port_info.direction() == directions[d])
832  {
833  port_names.insert(port_name);
834  }
835  }
836  for (auto& port : port_names)
837  {
838  ordered_ports.push_back(port);
839  }
840  }
841 
842  for (const auto& port_name : ordered_ports)
843  {
844  const auto& port_info = model.ports.at(port_name);
845 
846  XMLElement* port_element = nullptr;
847  switch (port_info.direction())
848  {
850  port_element = doc.NewElement("input_port");
851  break;
853  port_element = doc.NewElement("output_port");
854  break;
856  port_element = doc.NewElement("inout_port");
857  break;
858  }
859 
860  port_element->SetAttribute("name", port_name.c_str());
861  if (port_info.type())
862  {
863  port_element->SetAttribute("type", BT::demangle(port_info.type()).c_str());
864  }
865  if (!port_info.defaultValue().empty())
866  {
867  port_element->SetAttribute("default", port_info.defaultValue().c_str());
868  }
869 
870  if (!port_info.description().empty())
871  {
872  port_element->SetText(port_info.description().c_str());
873  }
874  element->InsertEndChild(port_element);
875  }
876 
877  if (!model.description.empty())
878  {
879  element->SetAttribute("description", model.registration_ID.c_str());
880  }
881 
882  model_root->InsertEndChild(element);
883  }
884 
885  XMLPrinter printer;
886  doc.Print(&printer);
887  return std::string(printer.CStr(), size_t(printer.CStrSize() - 1));
888 }
889 
890 Tree buildTreeFromText(const BehaviorTreeFactory& factory, const std::string& text,
891  const Blackboard::Ptr& blackboard)
892 {
893  XMLParser parser(factory);
894  parser.loadFromText(text);
895  return parser.instantiateTree(blackboard);
896 }
897 
898 Tree buildTreeFromFile(const BehaviorTreeFactory& factory, const std::string& filename,
899  const Blackboard::Ptr& blackboard)
900 {
901  XMLParser parser(factory);
902  parser.loadFromFile(filename);
903  return parser.instantiateTree(blackboard);
904 }
905 
906 } // namespace BT
Tree buildTreeFromText(const BehaviorTreeFactory &factory, const std::string &text, const Blackboard::Ptr &blackboard)
Pimpl(const BehaviorTreeFactory &fact)
Definition: xml_parsing.cpp:73
void SetText(const char *inText)
Definition: tinyxml2.cpp:1675
static Blackboard::Ptr create(Blackboard::Ptr parent={})
Definition: blackboard.h:36
const char * Name() const
Get the name of an element (which is the Value() of the node.)
Definition: tinyxml2.h:1269
XMLError LoadFile(const char *filename)
Definition: tinyxml2.cpp:2312
void recursivelyCreateTree(const std::string &tree_ID, Tree &output_tree, Blackboard::Ptr blackboard, const TreeNode::Ptr &root_parent)
static raw_event_t * buffer
Definition: minitrace.cpp:54
~XMLParser() override
Definition: xml_parsing.cpp:93
Pimpl * _p
Definition: xml_parsing.h:37
std::string toStr(T value)
Definition: basic_types.h:141
const XMLAttribute * FirstAttribute() const
Return the first attribute in the list.
Definition: tinyxml2.h:1514
const std::set< std::string > & builtinNodes() const
List of builtin IDs.
Definition: bt_factory.cpp:273
bool Error() const
Return true if there was an error parsing the document.
Definition: tinyxml2.h:1881
void loadFromFile(const std::string &filename, bool add_includes=true) override
Definition: xml_parsing.cpp:98
int CStrSize() const
Definition: tinyxml2.h:2314
void Print(XMLPrinter *streamer=0) const
Definition: tinyxml2.cpp:2446
std::vector< Blackboard::Ptr > blackboard_stack
Definition: bt_factory.h:129
filesystem::path current_path
Definition: xml_parsing.cpp:69
void VerifyXML(const std::string &xml_text, const std::unordered_map< std::string, NodeType > &registered_nodes)
std::list< std::unique_ptr< tinyxml2::XMLDocument > > opened_documents
Definition: xml_parsing.cpp:64
const std::string & defaultValue() const
std::shared_ptr< Blackboard > Ptr
Definition: blackboard.h:25
const char * CStr() const
Definition: tinyxml2.h:2306
static const char * xml_text
void clearInternalState() override
Blackboard::Ptr blackboard
Definition: tree_node.h:49
const XMLElement * NextSiblingElement(const char *name=0) const
Get the next (right) sibling element of this node, with an optionally supplied name.
Definition: tinyxml2.cpp:1018
void SetAttribute(const char *name, const char *value)
Sets the named attribute to value.
Definition: tinyxml2.h:1465
const std::unordered_set< std::string > ReservedPortNames
Definition: basic_types.h:219
XMLElement * NewElement(const char *name)
Definition: tinyxml2.cpp:2239
Tree instantiateTree(const Blackboard::Ptr &root_blackboard, std::string main_tree_to_execute={}) override
XMLElement * RootElement()
Definition: tinyxml2.h:1810
std::string demangle(char const *name)
Definition: demangle_util.h:72
auto StrEqual
Definition: xml_parsing.cpp:45
string manifest
The BehaviorTreeFactory is used to create instances of a TreeNode at run-time.
Definition: bt_factory.h:251
nonstd::string_view StringView
Definition: basic_types.h:55
const BehaviorTreeFactory & factory
Definition: xml_parsing.cpp:67
void loadDocImpl(tinyxml2::XMLDocument *doc, bool add_includes)
XMLNode * InsertFirstChild(XMLNode *addThis)
Definition: tinyxml2.cpp:925
const char * ErrorName() const
Definition: tinyxml2.cpp:2512
void loadFromText(const std::string &xml_text, bool add_includes=true) override
std::map< std::string, const XMLElement * > tree_roots
Definition: xml_parsing.cpp:65
bool convertFromString< bool >(StringView str)
PortsRemapping output_ports
Definition: tree_node.h:51
Struct used to store a tree. If this object goes out of scope, the tree is destroyed.
Definition: bt_factory.h:125
Simple class for manipulating paths on Linux/Windows/Mac OS.
Definition: path.h:42
ROSLIB_DECL std::string getPath(const std::string &package_name)
const char * Attribute(const char *name, const char *value=0) const
Definition: tinyxml2.cpp:1595
const XMLElement * FirstChildElement(const char *name=0) const
Definition: tinyxml2.cpp:994
std::vector< std::string > registeredBehaviorTrees() const override
const XMLAttribute * Next() const
The next attribute in the list.
Definition: tinyxml2.h:1154
std::vector< TreeNode::Ptr > nodes
Definition: bt_factory.h:128
static volatile int count
Definition: minitrace.cpp:55
static StringView stripBlackboardPointer(StringView str)
Definition: tree_node.cpp:162
void getPortsRecursively(const XMLElement *element, std::vector< std::string > &output_ports)
The XMLParser is a class used to read the model of a BehaviorTree from file or text and instantiate t...
Definition: xml_parsing.h:15
const std::unordered_map< std::string, TreeNodeManifest > & manifests() const
Manifests of all the registered TreeNodes.
Definition: bt_factory.cpp:268
static bool isBlackboardPointer(StringView str)
Definition: tree_node.cpp:145
XMLParser(const BehaviorTreeFactory &factory)
Definition: xml_parsing.cpp:90
std::shared_ptr< TreeNode > Ptr
Definition: tree_node.h:58
PortDirection direction() const
XMLError Parse(const char *xml, size_t nBytes=static_cast< size_t >(-1))
Definition: tinyxml2.cpp:2415
TreeNode::Ptr createNodeFromXML(const XMLElement *element, const Blackboard::Ptr &blackboard, const TreeNode::Ptr &node_parent)
std::basic_string< CharT, Traits > to_string(basic_string_view< CharT, Traits > v)
PortDirection
Definition: basic_types.h:48
XMLNode * InsertEndChild(XMLNode *addThis)
Definition: tinyxml2.cpp:895
void initialize()
Definition: bt_factory.h:153
PortsRemapping input_ports
Definition: tree_node.h:50
Tree buildTreeFromFile(const BehaviorTreeFactory &factory, const std::string &filename, const Blackboard::Ptr &blackboard)
std::string writeTreeNodesModelXML(const BehaviorTreeFactory &factory, bool include_builtin=false)
static Optional< StringView > getRemappedKey(StringView port_name, StringView remapping_value)
Definition: tree_node.cpp:179
std::unordered_map< std::string, std::string > PortsRemapping
Definition: tree_node.h:42


behaviortree_cpp_v3
Author(s): Michele Colledanchise, Davide Faconti
autogenerated on Mon Jul 3 2023 02:50:14