tree_node.h
Go to the documentation of this file.
1 /* Copyright (C) 2015-2018 Michele Colledanchise - All Rights Reserved
2 * Copyright (C) 2018-2020 Davide Faconti, Eurecat - All Rights Reserved
3 *
4 * Permission is hereby granted, free of charge, to any person obtaining a copy of this software and associated documentation files (the "Software"),
5 * to deal in the Software without restriction, including without limitation the rights to use, copy, modify, merge, publish, distribute, sublicense,
6 * 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:
7 * The above copyright notice and this permission notice shall be included in all copies or substantial portions of the Software.
8 *
9 * THE SOFTWARE IS PROVIDED "AS IS", WITHOUT WARRANTY OF ANY KIND, EXPRESS OR IMPLIED, INCLUDING BUT NOT LIMITED TO THE WARRANTIES OF MERCHANTABILITY,
10 * 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,
11 * 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.
12 */
13 
14 #pragma once
15 
16 #include <condition_variable>
17 #include <mutex>
18 #include <map>
19 
26 
27 #ifdef _MSC_VER
28 #pragma warning(disable : 4127)
29 #endif
30 
31 namespace BT
32 {
35 {
37  std::string registration_ID;
39  std::string description;
40 };
41 
42 typedef std::unordered_map<std::string, std::string> PortsRemapping;
43 
45 {
47  {}
48 
50  PortsRemapping input_ports;
51  PortsRemapping output_ports;
52 };
53 
55 class TreeNode
56 {
57 public:
58  typedef std::shared_ptr<TreeNode> Ptr;
59 
70  TreeNode(std::string name, NodeConfiguration config);
71 
72  virtual ~TreeNode() = default;
73 
75  virtual BT::NodeStatus executeTick();
76 
79  virtual void halt() = 0;
80 
81  bool isHalted() const;
82 
83  NodeStatus status() const;
84 
86  const std::string& name() const;
87 
90  BT::NodeStatus waitValidStatus();
91 
92  virtual NodeType type() const = 0;
93 
96  using StatusChangeCallback = StatusChangeSignal::CallableFunction;
97 
99  std::function<Optional<NodeStatus>(TreeNode&, NodeStatus)>;
101  std::function<Optional<NodeStatus>(TreeNode&, NodeStatus, NodeStatus)>;
102 
112  StatusChangeSubscriber subscribeToStatusChange(StatusChangeCallback callback);
113 
123  void setPreTickOverrideFunction(PreTickOverrideCallback callback);
124 
133  void setPostTickOverrideFunction(PostTickOverrideCallback callback);
134 
135  // get an unique identifier of this instance of treeNode
136  uint16_t UID() const;
137 
139  const std::string& registrationName() const;
140 
143  const NodeConfiguration& config() const;
144 
152  template <typename T>
153  Result getInput(const std::string& key, T& destination) const;
154 
158  template <typename T>
159  Optional<T> getInput(const std::string& key) const
160  {
161  T out;
162  auto res = getInput(key, out);
163  return (res) ? Optional<T>(out) : nonstd::make_unexpected(res.error());
164  }
165 
166  template <typename T>
167  Result setOutput(const std::string& key, const T& value);
168 
169  // function provide mostrly for debugging purpose to see the raw value
170  // in the port (no remapping and no conversion to a type)
171  StringView getRawPortValue(const std::string& key) const;
172 
175  static bool isBlackboardPointer(StringView str);
176 
177  static StringView stripBlackboardPointer(StringView str);
178 
179  static Optional<StringView> getRemappedKey(StringView port_name,
180  StringView remapping_value);
181 
182  // Notify the tree should be ticked again()
183  void emitStateChanged();
184 
185 protected:
187  virtual BT::NodeStatus tick() = 0;
188 
189  friend class BehaviorTreeFactory;
190  friend class DecoratorNode;
191  friend class ControlNode;
192  friend class Tree;
193 
194  // Only BehaviorTreeFactory should call this
195  void setRegistrationID(StringView ID);
196 
197  void setWakeUpInstance(std::shared_ptr<WakeUpSignal> instance);
198 
199  void modifyPortsRemapping(const PortsRemapping& new_remapping);
200 
201  void setStatus(NodeStatus new_status);
202 
204  void resetStatus();
205 
206 private:
207  const std::string name_;
208 
209  NodeStatus status_;
210 
211  std::condition_variable state_condition_variable_;
212 
214 
216 
217  const uint16_t uid_;
218 
220 
221  std::string registration_ID_;
222 
224 
225  PostTickOverrideCallback post_condition_callback_;
226 
227  std::shared_ptr<WakeUpSignal> wake_up_;
228 };
229 
230 //-------------------------------------------------------
231 template <typename T>
232 inline Result TreeNode::getInput(const std::string& key, T& destination) const
233 {
234  auto remap_it = config_.input_ports.find(key);
235  if (remap_it == config_.input_ports.end())
236  {
237  return nonstd::make_unexpected(StrCat("getInput() failed because "
238  "NodeConfiguration::input_ports "
239  "does not contain the key: [",
240  key, "]"));
241  }
242  auto remapped_res = getRemappedKey(key, remap_it->second);
243  try
244  {
245  if (!remapped_res)
246  {
247  destination = convertFromString<T>(remap_it->second);
248  return {};
249  }
250  const auto& remapped_key = remapped_res.value();
251 
252  if (!config_.blackboard)
253  {
254  return nonstd::make_unexpected("getInput() trying to access a Blackboard(BB) "
255  "entry, "
256  "but BB is invalid");
257  }
258 
259  std::unique_lock<std::mutex> entry_lock(config_.blackboard->entryMutex());
260  const Any* val = config_.blackboard->getAny(static_cast<std::string>(remapped_key));
261 
262  if(!val)
263  {
264  return nonstd::make_unexpected(StrCat("getInput() failed because it was unable to "
265  "find the port [", key,
266  "] remapped to BB [", remapped_key, "]"));
267  }
268 
269  if(val->empty())
270  {
271  return nonstd::make_unexpected(StrCat("getInput() failed because the port [", key,
272  "] remapped to BB [", remapped_key, "] was found,"
273  "but its content was not initialized correctly"));
274  }
275 
276  if (!std::is_same<T, std::string>::value && val->type() == typeid(std::string))
277  {
278  destination = convertFromString<T>(val->cast<std::string>());
279  }
280  else
281  {
282  destination = val->cast<T>();
283  }
284  return {};
285  }
286  catch (std::exception& err)
287  {
288  return nonstd::make_unexpected(err.what());
289  }
290 }
291 
292 template <typename T>
293 inline Result TreeNode::setOutput(const std::string& key, const T& value)
294 {
295  if (!config_.blackboard)
296  {
297  return nonstd::make_unexpected("setOutput() failed: trying to access a "
298  "Blackboard(BB) entry, but BB is invalid");
299  }
300 
301  auto remap_it = config_.output_ports.find(key);
302  if (remap_it == config_.output_ports.end())
303  {
304  return nonstd::make_unexpected(StrCat("setOutput() failed: "
305  "NodeConfiguration::output_ports "
306  "does not "
307  "contain the key: [",
308  key, "]"));
309  }
310  StringView remapped_key = remap_it->second;
311  if (remapped_key == "=")
312  {
313  remapped_key = key;
314  }
315  if (isBlackboardPointer(remapped_key))
316  {
317  remapped_key = stripBlackboardPointer(remapped_key);
318  }
319  config_.blackboard->set(static_cast<std::string>(remapped_key), value);
320 
321  return {};
322 }
323 
324 // Utility function to fill the list of ports using T::providedPorts();
325 template <typename T>
327 {
328  for (const auto& it : getProvidedPorts<T>())
329  {
330  const auto& port_name = it.first;
331  const auto direction = it.second.direction();
332  if (direction != PortDirection::OUTPUT)
333  {
334  config.input_ports[port_name] = "=";
335  }
336  if (direction != PortDirection::INPUT)
337  {
338  config.output_ports[port_name] = "=";
339  }
340  }
341 }
342 
343 } // namespace BT
std::string registration_ID_
Definition: tree_node.h:221
std::condition_variable state_condition_variable_
Definition: tree_node.h:211
NodeConfiguration config_
Definition: tree_node.h:219
const uint16_t uid_
Definition: tree_node.h:217
StatusChangeSignal::Subscriber StatusChangeSubscriber
Definition: tree_node.h:95
PostTickOverrideCallback post_condition_callback_
Definition: tree_node.h:225
Optional< T > getInput(const std::string &key) const
Definition: tree_node.h:159
const std::string name_
Definition: tree_node.h:207
StatusChangeSignal::CallableFunction StatusChangeCallback
Definition: tree_node.h:96
std::shared_ptr< WakeUpSignal > wake_up_
Definition: tree_node.h:227
static pthread_mutex_t mutex
Definition: minitrace.cpp:61
std::shared_ptr< Blackboard > Ptr
Definition: blackboard.h:25
This information is used mostly by the XMLParser.
Definition: tree_node.h:34
Result setOutput(const std::string &key, const T &value)
Definition: tree_node.h:293
std::mutex state_mutex_
Definition: tree_node.h:213
Blackboard::Ptr blackboard
Definition: tree_node.h:49
Optional< void > Result
Definition: basic_types.h:217
std::shared_ptr< CallableFunction > Subscriber
Definition: signal.h:19
The BehaviorTreeFactory is used to create instances of a TreeNode at run-time.
Definition: bt_factory.h:251
std::string StrCat()
Definition: strcat.hpp:47
PreTickOverrideCallback pre_condition_callback_
Definition: tree_node.h:223
nonstd::string_view StringView
Definition: basic_types.h:55
std::string registration_ID
Definition: tree_node.h:37
NodeStatus status_
Definition: tree_node.h:209
std::function< Optional< NodeStatus >(TreeNode &, NodeStatus, NodeStatus)> PostTickOverrideCallback
Definition: tree_node.h:101
Result getInput(const std::string &key, T &destination) const
Definition: tree_node.h:232
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
Abstract base class for Behavior Tree Nodes.
Definition: tree_node.h:55
std::unordered_map< std::string, PortInfo > PortsList
Definition: basic_types.h:333
StatusChangeSignal state_change_signal_
Definition: tree_node.h:215
std::function< Optional< NodeStatus >(TreeNode &, NodeStatus)> PreTickOverrideCallback
Definition: tree_node.h:99
nonstd::expected< T, std::string > Optional
Definition: basic_types.h:197
NodeStatus
Definition: basic_types.h:35
std::shared_ptr< TreeNode > Ptr
Definition: tree_node.h:58
NodeType
Enumerates the possible types of nodes.
Definition: basic_types.h:22
PortsRemapping input_ports
Definition: tree_node.h:50
std::string description
Definition: tree_node.h:39
void assignDefaultRemapping(NodeConfiguration &config)
Definition: tree_node.h:326
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