Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
std::_Unique_if< _Ty >
std::_Unique_if< _Ty[]>
std::_Unique_if< _Ty[N]>
Action_A
Action_B
BT::ActionNodeBaseThe ActionNodeBase is the base class to use to create any kind of action. A particular derived class is free to override executeTick() as needed
ActionTestNode
flatbuffers::Allocator
BT::AlwaysFailureNode
BT::AlwaysSuccessNode
BT::Any
DummyNodes::ApproachObject
BT::AsyncActionNodeThe AsyncActionNode uses a different thread where the action will be executed
BT::AsyncActionTest
BackUpAndSpin
linb::bad_any_cast
BB_TestNode
BB_TypedTestNode
Serialization::BehaviorTreeBuilder
conanfile.BehaviorTreeConan
BT::BehaviorTreeException
BT::BehaviorTreeFactoryThe BehaviorTreeFactory is used to create instances of a TreeNode at run-time
BehaviorTreeTest
BT::BlackboardThe Blackboard is the mechanism used by BehaviorTrees to exchange typed data
BT::BlackboardPreconditionNode< T >
BT_TinyXML2::MemPoolT< ITEM_SIZE >::Block
build.BuilderSettings
CalculateGoal
coroutine::Channel< Type >
ComplexFallbackWithMemoryTest
ComplexParallelTest
ComplexSequence2ActionsTest
ComplexSequenceTest
ComplexSequenceWithMemoryTest
ComputePathToPose
BT::ConditionNode
BT::ConditionTestNode
BT::ControlNode
BT::CoroActionNodeIdeal candidate for asynchronous actions which need to communicate with an external service using an asynch request/reply interface (being notable examples ActionLib in ROS, MoveIt clients or move_base clients)
DeadlineTest
BT::DecoratorNode
BT::DecoratorSubtreeNode
flatbuffers::DefaultAllocator
BT_TinyXML2::XMLDocument::DepthTracker
flatbuffers::DetachedBuffer
BT_TinyXML2::DynArray< T, INITIAL_SIZE >
BT_TinyXML2::Entity
BT::Blackboard::Entry
BT::FallbackNodeThe FallbackNode is used to try different strategies, until one succeeds. If any child returns RUNNING, previous children will NOT be ticked again
flatbuffers::FlatBufferBuilder::FieldLoc
BT::FileLogger
linb::final
flatbuffers::FlatBufferBuilderHelper class to hold data needed in creation of a FlatBuffer. To serialize data, you typically call one of the `Create*()` functions in the generated code, which in turn call a sequence of `StartTable`/ `PushElement`/`AddElement`/`EndTable`, or the builtin `CreateString`/ `CreateVector` functions. Do this is depth-first order to build up a tree to the root. `Finish()` wraps up the buffer ready for transport
Serialization::FLATBUFFERS_FINAL_CLASS
FollowPath
BT::ForceFailureNodeThe ForceFailureNode returns always FAILURE or RUNNING
BT::ForceSuccessNodeThe ForceSuccessNode returns always SUCCESS or RUNNING
DummyNodes::GripperInterface
BT::has_static_method_providedPorts< T, typename >
BT::has_static_method_providedPorts< T, typename std::enable_if< std::is_same< decltype(T::providedPorts()), PortsList >::value >::type >
std::hash< nonstd::expected< T &, E > >
std::hash< nonstd::expected< T, E > >
std::hash< nonstd::expected< void, E > >
nonstd::detail::in_place_index_tag< K >
nonstd::in_place_t
nonstd::detail::in_place_type_tag< T >
flatbuffers::IndirectHelper< T >
flatbuffers::IndirectHelper< const T * >
flatbuffers::IndirectHelper< Offset< T > >
BT::InverterNodeThe InverterNode returns SUCCESS if child fails of FAILURE is child succeeds. RUNNING status is propagated
flatbuffers::is_floating_point< T >
SafeAny::details::is_integer< T >
SafeAny::details::is_safe_integer_conversion< From, To >
flatbuffers::is_same< T, U >
SafeAny::details::is_same_real< From, To >
flatbuffers::is_scalar< T >
flatbuffers::is_unsigned< T >
IsStuck
BT_TinyXML2::MemPoolT< ITEM_SIZE >::Item
BT::LeafNode
BT::LogicError
BT_TinyXML2::LongFitsIntoSizeTMinusOne< bool >
BT_TinyXML2::LongFitsIntoSizeTMinusOne< false >
flatbuffers::make_unsigned< T >
BT_TinyXML2::MemPool
BT_TinyXML2::MemPoolT< ITEM_SIZE >
BT::MinitraceLogger
MoveBaseAction
minitrace::MTRScopedTrace
minitrace::MTRScopedTraceArg
minitrace::MTRScopedTraceLimit
MyAction
MyAsyncAction
MyCondition
MyLegacyMoveTo
BT::NodeConfiguration
Serialization::NodeModelBuilder
flatbuffers::numeric_limits< T >
flatbuffers::Offset< T >
coroutine::Ordinator
BT::ParallelNode
BT::ParserThe BehaviorTreeParser is a class used to read the model of a BehaviorTree from file or text and instantiate the corresponding tree using the BehaviorTreeFactory
pathSimple class for manipulating paths on Linux/Windows/Mac OS
BT::CoroActionNode::Pimpl
BT::PublisherZMQ::Pimpl
BT::XMLParser::Pimpl
Point3D
Serialization::PortConfigBuilder
BT::PortInfo
Serialization::PortModelBuilder
Pose2D
Position2D
PrintTarget
BT::PublisherZMQ
BT::TimerQueue::Queue
minitrace::raw_event
BT::ReactiveFallbackThe ReactiveFallback is similar to a ParallelNode. All the children are ticked from first to last:
ReactiveFallbackTest
BT::ReactiveSequenceThe ReactiveSequence is similar to a ParallelNode. All the children are ticked from first to last:
RefCountClass
BT::RepeatNodeThe RepeatNode is used to execute a child several times, as long as it succeed
RepeatTest
linb::final::requires_allocation< T >Whether the type T must be dynamically allocated or can be stored on the stack
resolverSimple class for resolving paths on Linux/Windows/Mac OS
BT::RetryNodeThe RetryNode is used to execute a child several times if it fails
RetryTest
coroutine::Routine
BT::RuntimeError
DummyNodes::SaySomething
BT::scoped_demangled_name
BT::details::Semaphore
BT::SequenceNodeThe SequenceNode is used to tick children in an ordered sequence. If any child returns RUNNING, previous children will NOT be ticked again
BT::SequenceStarNodeThe SequenceStarNode is used to tick children in an ordered sequence. If any child returns RUNNING, previous children are not ticked again
SequenceTripleActionTest
BT::SetBlackboardThe SetBlackboard is action used to store a string into an entry of the Blackboard specified in "output_key"
BT::SharedLibrary
BT::Signal< CallableArgs >
BT::SimpleActionNodeThe SimpleActionNode provides an easy to use SyncActionNode. The user should simply provide a callback with this signature
BT::SimpleConditionNodeThe SimpleConditionNode provides an easy to use ConditionNode. The user should simply provide a callback with this signature
SimpleCoroAction
BT::SimpleDecoratorNodeThe SimpleDecoratorNode provides an easy to use DecoratorNode. The user should simply provide a callback with this signature
SimpleFallbackTest
SimpleFallbackWithMemoryTest
SimpleParallelTest
SimpleSequenceTest
SimpleSequenceWithMemoryTest
SafeAny::SimpleString
Serialization::StatusChangeLogBuilder
BT::StatusChangeLogger
BT::StdCoutLoggerAddStdCoutLoggerToTree. Give the root node of a tree, a simple callback is subscribed to any status change of each node
linb::final::storage_union
flatbuffers::String
flatbuffers::FlatBufferBuilder::StringOffsetCompare
BT_TinyXML2::StrPair
BT::SyncActionNodeThe SyncActionNode is an ActionNode that explicitly prevents the status RUNNING and doesn't require an implementation of halt()
BT::SyncActionTest
TestNode
conanfile.TestPackageConan
ThinkWhatToSay
TimeoutAndRetry
BT::TimeoutNodeThe TimeoutNode will halt() a running child if the latter has been RUNNING for more than a give time. The timeout is in millisecons and it is passed using the port "msec"
BT::TimerQueue
BT::TreeStruct used to store a tree. If this object goes out of scope, the tree is destroyed
BT::TreeNodeAbstract base class for Behavior Tree Nodes
Serialization::TreeNodeBuilder
BT::TreeNodeManifestThis information is used mostly by the XMLParser
flatbuffers::unique_ptr< T >
flatbuffers::Vector< T >
flatbuffers::vector_downward
flatbuffers::VectorIterator< T, IT >
flatbuffers::VectorOfAny
flatbuffers::VectorReverseIterator< Iterator >
linb::final::vtable_dynamic< T >VTable for dynamically allocated storage
linb::final::vtable_stack< T >VTable for stack allocated storage
linb::final::vtable_typeBase VTable specification
BT::TimerQueue::WorkItem
BT_TinyXML2::XMLAttribute
BT_TinyXML2::XMLComment
BT_TinyXML2::XMLConstHandle
BT_TinyXML2::XMLDeclaration
BT_TinyXML2::XMLDocument
BT_TinyXML2::XMLElement
BT_TinyXML2::XMLHandle
BT_TinyXML2::XMLNode
BT::XMLParserThe XMLParser is a class used to read the model of a BehaviorTree from file or text and instantiate the corresponding tree using the BehaviorTreeFactory
BT_TinyXML2::XMLPrinter
BT_TinyXML2::XMLText
BT_TinyXML2::XMLUnknown
BT_TinyXML2::XMLUtil
BT_TinyXML2::XMLVisitor


behaviortree_cpp
Author(s): Michele Colledanchise, Davide Faconti
autogenerated on Sat Jun 8 2019 20:17:16