►NBT | |
►NAst | |
CEnvironment | Used to encapsulate the information and states needed by the scripting language |
CExprAssignment | |
CExprBase | |
CExprBinaryArithmetic | |
CExprComparison | |
CExprIf | |
CExprLiteral | |
CExprName | |
CExprUnaryArithmetic | |
►Ndetails | The SwitchNode is equivalent to a switch statement, where a certain branch (child) is executed according to the value of a blackboard entry |
CSemaphore | |
►NGrammar | |
C_xid_start_character | |
CAnyValue | |
►CBooleanLiteral | |
CFalse | |
CTrue | |
►CExpression | |
Cassignment | |
Cbit_and | |
Cbit_or | |
Cbit_prefix | |
Ccomparison | |
Cconditional | |
Cexpected_operand | |
Clogical | |
Cmath_prefix | |
Cmath_product | |
Cmath_sum | |
Cstring_concat | |
►CInteger | |
Cinteger | |
Cinvalid_suffix | |
CName | |
Cnested_expr | |
►CReal | |
Cinvalid_suffix | |
Cstmt | |
CStringLiteral | |
►NMonitor | |
CHook | |
CReplyHeader | |
CRequestHeader | |
►Ntest | |
CAsyncTestAction | |
CSimpleCondition | |
CActionNodeBase | The ActionNodeBase is the base class to use to create any kind of action. A particular derived class is free to override executeTick() as needed |
CAlwaysFailureNode | |
CAlwaysSuccessNode | |
CAny | |
CAnyTypeAllowed | |
CAsyncActionTest | |
CBehaviorTreeException | |
►CBehaviorTreeFactory | The BehaviorTreeFactory is used to create instances of a TreeNode at run-time |
CPImpl | |
►CBlackboard | The Blackboard is the mechanism used by BehaviorTrees to exchange typed data |
CEntry | |
CConditionNode | |
CConditionTestNode | |
CConsumeQueue | |
CControlNode | |
►CCoroActionNode | A good candidate for asynchronous actions which need to communicate with an external service using an async request/reply interface |
CPimpl | |
CDecoratorNode | |
CDelayNode | The delay node will introduce a delay and then tick the child returning the status of the child as it is upon completion The delay is in milliseconds and it is passed using the port "delay_msec" |
CEntryUpdatedAction | The EntryUpdatedAction checks the Timestamp in an entry to determine if the value was updated since the last time |
CEntryUpdatedDecorator | The EntryUpdatedDecorator checks the Timestamp in an entry to determine if the value was updated since the last time (true, the first time) |
CFallbackNode | The FallbackNode is used to try different strategies, until one succeeds. If any child returns RUNNING, previous children will NOT be ticked again |
►CFileLogger2 | The FileLogger2 is a logger that saves the tree as XML and all the transitions. Data is written to file in a separate thread, to minimize latency |
CPImpl | |
CTransition | |
CForceFailureNode | The ForceFailureNode returns always FAILURE or RUNNING |
CForceSuccessNode | The ForceSuccessNode returns always SUCCESS or RUNNING |
►CGroot2Publisher | The Groot2Publisher is used to create an interface between your BT.CPP executor and Groot2 |
CPImpl | |
Chas_static_method_metadata | |
Chas_static_method_metadata< T, typename std::enable_if< std::is_same< decltype(T::metadata()), KeyValueVector >::value >::type > | |
Chas_static_method_providedPorts | |
Chas_static_method_providedPorts< T, typename std::enable_if< std::is_same< decltype(T::providedPorts()), PortsList >::value >::type > | |
CIfThenElseNode | IfThenElseNode must have exactly 2 or 3 children. This node is NOT reactive |
CInverterNode | The InverterNode returns SUCCESS if child fails of FAILURE is child succeeds. RUNNING status is propagated |
CJsonExporter | |
CKeepRunningUntilFailureNode | The KeepRunningUntilFailureNode returns always FAILURE or RUNNING |
CLeafNode | |
CLockedPtr | The LockedPtr class is used to share a pointer to an object and a mutex that protects the read/write access to that object |
CLogicError | |
CLoopNode | The LoopNode class is used to pop_front elements from a std::deque. This element is copied into the port "value" and the child will be executed, as long as we have elements in the queue |
CManualSelectorNode | Use a Terminal User Interface (ncurses) to select a certain child manually |
CMinitraceLogger | |
CNodeConfig | |
CParallelAllNode | The ParallelAllNode execute all its children concurrently, but not in separate threads! |
CParallelNode | The ParallelNode execute all its children concurrently, but not in separate threads! |
CParser | The BehaviorTreeParser is a class used to read the model of a BehaviorTree from file or text and instantiate the corresponding tree using the BehaviorTreeFactory |
CPopFromQueue | |
CPortInfo | |
CPreconditionNode | |
CProtectedQueue | |
CQueueSize | |
CReactiveFallback | The ReactiveFallback is similar to a ParallelNode. All the children are ticked from first to last: |
CReactiveSequence | The ReactiveSequence is similar to a ParallelNode. All the children are ticked from first to last: |
CRepeatNode | The RepeatNode is used to execute a child several times, as long as it succeed |
CRetryNode | The RetryNode is used to execute a child several times if it fails |
CRetryNodeTypo | |
CRunOnceNode | The RunOnceNode is used when you want to execute the child only once. If the child is asynchronous, we will tick until either SUCCESS or FAILURE is returned |
CRuntimeError | |
Cscoped_demangled_name | |
CScriptCondition | Execute a script, and if the result is true, return SUCCESS, FAILURE otherwise |
CScriptNode | |
CSequenceNode | The SequenceNode is used to tick children in an ordered sequence. If any child returns RUNNING, previous children will NOT be ticked again |
CSequenceWithMemory | The SequenceWithMemory is used to tick children in an ordered sequence. If any child returns RUNNING, previous children are not ticked again |
CSetBlackboardNode | The SetBlackboard is action used to store a string into an entry of the Blackboard specified in "output_key" |
CSharedLibrary | |
CSignal | |
CSimpleActionNode | The SimpleActionNode provides an easy to use SyncActionNode. The user should simply provide a callback with this signature |
CSimpleConditionNode | The SimpleConditionNode provides an easy to use ConditionNode. The user should simply provide a callback with this signature |
CSimpleDecoratorNode | The SimpleDecoratorNode provides an easy to use DecoratorNode. The user should simply provide a callback with this signature |
CSleepNode | Sleep for a certain amount of time. Consider also using the decorator <Delay> |
►CSqliteLogger | The SqliteLogger is a logger that will store the tree and all the status transitions in a SQLite database (single file) |
CTransition | |
CStampedValue | |
CStatefulActionNode | The StatefulActionNode is the preferred way to implement asynchronous Actions. It is actually easier to use correctly, when compared with ThreadedAction |
CStatusChangeLogger | |
CStdCoutLogger | StdCoutLogger is a very simple logger that displays all the transitions on the console |
CSubtreeModel | |
CSubTreeNode | The SubTreeNode is a way to wrap an entire Subtree, creating a separated BlackBoard. If you want to have data flow through ports, you need to explicitly remap the ports |
CSwitchNode | |
CSyncActionNode | The SyncActionNode is an ActionNode that explicitly prevents the status RUNNING and doesn't require an implementation of halt() |
CSyncActionTest | |
CTestNode | The TestNode is a Node that can be configure to: |
CTestNodeConfig | |
CThreadedAction | The ThreadedAction executes the tick in a different thread |
CTimeoutNode | The TimeoutNode will halt() a running child if the latter has been RUNNING longer than a given time. The timeout is in milliseconds and it is passed using the port "msec" |
►CTimerQueue | |
CQueue | |
CWorkItem | |
CTimestamp | |
CTransition | |
►CTree | Struct used to store a tree. If this object goes out of scope, the tree is destroyed |
CSubtree | |
►CTreeNode | Abstract base class for Behavior Tree Nodes |
CPImpl | |
CTreeNodeManifest | This information is used mostly by the XMLParser |
►CTreeObserver | The TreeObserver is used to collect statistics about which nodes are executed and their returned status |
CNodeStatistics | |
CTypeInfo | |
CUnsetBlackboardNode | |
CWakeUpSignal | |
CWhileDoElseNode | WhileDoElse must have exactly 2 or 3 children. It is a REACTIVE node of IfThenElseNode |
►CXMLParser | The XMLParser is a class used to read the model of a BehaviorTree from file or text and instantiate the corresponding tree using the BehaviorTreeFactory |
CPImpl | |
►Ncx | |
Cbasic_string_view | |
Cequal_to | |
Cequal_to< void > | |
Cless | |
Cless< void > | |
►Ndetail | Detail namespace with internal helper functions |
►Ncontainer_input_adapter_factory_impl | |
Ccontainer_input_adapter_factory | |
Ccontainer_input_adapter_factory< ContainerType, void_t< decltype(begin(std::declval< ContainerType >()), end(std::declval< ContainerType >()))> > | |
►Ndtoa_impl | Implements the Grisu2 algorithm for binary to decimal floating-point conversion |
Cboundaries | |
Ccached_power | |
Cdiyfp | |
►Nutility_internal | |
CExtend | |
CExtend< integer_sequence< T, Ints... >, SeqSize, 0 > | |
CExtend< integer_sequence< T, Ints... >, SeqSize, 1 > | |
CGen | |
CGen< T, 0 > | |
Cactual_object_comparator | |
Cbinary_reader | Deserialization of CBOR, MessagePack, and UBJSON values |
Cbinary_writer | Serialization to CBOR and MessagePack values |
Cchar_traits | |
Cchar_traits< signed char > | |
Cchar_traits< unsigned char > | |
Cconjunction | |
Cconjunction< B > | |
Cconjunction< B, Bn... > | |
Cdetector | |
Cdetector< Default, void_t< Op< Args... > >, Op, Args... > | |
Cexception | General exception of the basic_json class |
Cexternal_constructor | |
Cexternal_constructor< value_t::array > | |
Cexternal_constructor< value_t::binary > | |
Cexternal_constructor< value_t::boolean > | |
Cexternal_constructor< value_t::number_float > | |
Cexternal_constructor< value_t::number_integer > | |
Cexternal_constructor< value_t::number_unsigned > | |
Cexternal_constructor< value_t::object > | |
Cexternal_constructor< value_t::string > | |
Cfile_input_adapter | |
Cfrom_json_fn | |
Chas_from_json | |
Chas_from_json< BasicJsonType, T, enable_if_t< !is_basic_json< T >::value > > | |
Chas_key_compare | |
Chas_non_default_from_json | |
Chas_non_default_from_json< BasicJsonType, T, enable_if_t< !is_basic_json< T >::value > > | |
Chas_to_json | |
Chas_to_json< BasicJsonType, T, enable_if_t< !is_basic_json< T >::value > > | |
Cidentity_tag | |
Cinput_stream_adapter | |
Cinteger_sequence | |
Cinternal_iterator | Iterator value |
Cinvalid_iterator | Exception indicating errors with iterators |
Cis_basic_json | |
Cis_basic_json< NLOHMANN_BASIC_JSON_TPL > | |
Cis_basic_json_context | |
Cis_c_string | |
Cis_comparable | |
Cis_comparable< Compare, A, B, void_t< decltype(std::declval< Compare >()(std::declval< A >(), std::declval< B >())), decltype(std::declval< Compare >()(std::declval< B >(), std::declval< A >()))> > | |
Cis_compatible_array_type | |
Cis_compatible_array_type_impl | |
Cis_compatible_array_type_impl< BasicJsonType, CompatibleArrayType, enable_if_t< is_detected< iterator_t, CompatibleArrayType >::value &&is_iterator_traits< iterator_traits< detected_t< iterator_t, CompatibleArrayType > > >::value &&!std::is_same< CompatibleArrayType, detected_t< range_value_t, CompatibleArrayType > >::value > > | |
Cis_compatible_integer_type | |
Cis_compatible_integer_type_impl | |
Cis_compatible_integer_type_impl< RealIntegerType, CompatibleNumberIntegerType, enable_if_t< std::is_integral< RealIntegerType >::value &&std::is_integral< CompatibleNumberIntegerType >::value &&!std::is_same< bool, CompatibleNumberIntegerType >::value > > | |
Cis_compatible_object_type | |
Cis_compatible_object_type_impl | |
Cis_compatible_object_type_impl< BasicJsonType, CompatibleObjectType, enable_if_t< is_detected< mapped_type_t, CompatibleObjectType >::value &&is_detected< key_type_t, CompatibleObjectType >::value > > | |
Cis_compatible_string_type | |
Cis_compatible_type | |
Cis_compatible_type_impl | |
Cis_compatible_type_impl< BasicJsonType, CompatibleType, enable_if_t< is_complete_type< CompatibleType >::value > > | |
Cis_complete_type | |
Cis_complete_type< T, decltype(void(sizeof(T)))> | |
Cis_constructible | |
Cis_constructible< const std::pair< T1, T2 > > | |
Cis_constructible< const std::tuple< Ts... > > | |
Cis_constructible< std::pair< T1, T2 > > | |
Cis_constructible< std::tuple< Ts... > > | |
Cis_constructible_array_type | |
Cis_constructible_array_type_impl | |
Cis_constructible_array_type_impl< BasicJsonType, ConstructibleArrayType, enable_if_t< !std::is_same< ConstructibleArrayType, typename BasicJsonType::value_type >::value &&!is_compatible_string_type< BasicJsonType, ConstructibleArrayType >::value &&is_default_constructible< ConstructibleArrayType >::value &&(std::is_move_assignable< ConstructibleArrayType >::value||std::is_copy_assignable< ConstructibleArrayType >::value)&&is_detected< iterator_t, ConstructibleArrayType >::value &&is_iterator_traits< iterator_traits< detected_t< iterator_t, ConstructibleArrayType > > >::value &&is_detected< range_value_t, ConstructibleArrayType >::value &&!std::is_same< ConstructibleArrayType, detected_t< range_value_t, ConstructibleArrayType > >::value &&is_complete_type< detected_t< range_value_t, ConstructibleArrayType > >::value > > | |
Cis_constructible_array_type_impl< BasicJsonType, ConstructibleArrayType, enable_if_t< std::is_same< ConstructibleArrayType, typename BasicJsonType::value_type >::value > > | |
Cis_constructible_object_type | |
Cis_constructible_object_type_impl | |
Cis_constructible_object_type_impl< BasicJsonType, ConstructibleObjectType, enable_if_t< is_detected< mapped_type_t, ConstructibleObjectType >::value &&is_detected< key_type_t, ConstructibleObjectType >::value > > | |
Cis_constructible_string_type | |
Cis_constructible_tuple | |
Cis_constructible_tuple< T1, std::tuple< Args... > > | |
Cis_default_constructible | |
Cis_default_constructible< const std::pair< T1, T2 > > | |
Cis_default_constructible< const std::tuple< Ts... > > | |
Cis_default_constructible< std::pair< T1, T2 > > | |
Cis_default_constructible< std::tuple< Ts... > > | |
Cis_detected_lazy | |
Cis_getable | |
Cis_iterator_of_multibyte | |
Cis_iterator_traits | |
Cis_iterator_traits< iterator_traits< T > > | |
Cis_json_iterator_of | |
Cis_json_iterator_of< BasicJsonType, typename BasicJsonType::const_iterator > | |
Cis_json_iterator_of< BasicJsonType, typename BasicJsonType::iterator > | |
Cis_json_ref | |
Cis_json_ref< json_ref< T > > | |
►Cis_ordered_map | |
Ctwo | |
Cis_range | |
Cis_sax | |
Cis_sax_static_asserts | |
Cis_specialization_of | |
Cis_specialization_of< Primary, Primary< Args... > > | |
Cis_transparent | |
Citer_impl | Template for a bidirectional iterator for the basic_json class This class implements a both iterators (iterator and const_iterator) for the basic_json class |
Citeration_proxy | Proxy class for the items() function |
Citeration_proxy_value | |
Citerator_input_adapter | |
Citerator_input_adapter_factory | |
Citerator_input_adapter_factory< IteratorType, enable_if_t< is_iterator_of_multibyte< IteratorType >::value > > | |
Citerator_traits | |
Citerator_traits< T *, enable_if_t< std::is_object< T >::value > > | |
Citerator_traits< T, enable_if_t< !std::is_pointer< T >::value > > | |
Citerator_types | |
Citerator_types< It, void_t< typename It::difference_type, typename It::value_type, typename It::pointer, typename It::reference, typename It::iterator_category > > | |
Cjson_default_base | Default base class of the basic_json class |
Cjson_ref | |
Cjson_reverse_iterator | Template for a reverse iterator class |
Cjson_sax_acceptor | |
Cjson_sax_dom_callback_parser | |
Cjson_sax_dom_parser | SAX implementation to create a JSON value from SAX events |
Clexer | Lexical analysis |
Clexer_base | |
Cmake_void | |
Cnegation | |
Cnonesuch | |
Cother_error | Exception indicating other library errors |
Cout_of_range | Exception indicating access out of the defined range |
Coutput_adapter | |
Coutput_adapter_protocol | Abstract output adapter interface |
Coutput_stream_adapter | Output adapter for output streams |
Coutput_string_adapter | Output adapter for basic_string |
Coutput_vector_adapter | Output adapter for byte vectors |
Cparse_error | Exception indicating a parse error |
Cparser | Syntax analysis |
Cposition_t | Struct to capture the start position of the current token |
Cprimitive_iterator_t | |
Cpriority_tag | |
Cpriority_tag< 0 > | |
Cserializer | |
Cspan_input_adapter | |
Cstatic_const | |
Cto_json_fn | |
Ctype_error | Exception indicating executing a member function with a wrong type |
Cvalue_in_range_of_impl1 | |
Cvalue_in_range_of_impl1< OfType, T, false > | |
Cvalue_in_range_of_impl1< OfType, T, true > | |
Cvalue_in_range_of_impl2 | |
Cvalue_in_range_of_impl2< OfType, T, false, false > | |
Cvalue_in_range_of_impl2< OfType, T, false, true > | |
Cvalue_in_range_of_impl2< OfType, T, true, false > | |
Cvalue_in_range_of_impl2< OfType, T, true, true > | |
Cwide_string_input_adapter | |
Cwide_string_input_helper | |
Cwide_string_input_helper< BaseInputAdapter, 2 > | |
Cwide_string_input_helper< BaseInputAdapter, 4 > | |
►Ndoctest | |
CStringMaker< lexy::parse_tree< Reader, TokenKind, MemoryResource > > | |
►NDummyNodes | |
CApproachObject | |
CGripperInterface | |
CSaySomething | |
CSleepNode | |
►Nlexy | |
►N_detail | |
C_binding_power_of | |
C_detector | |
C_detector< Op, void_t< Op< Args... > >, Args... > | |
C_lazy_init_storage_non_trivial | |
C_lazy_init_storage_trivial | |
C_make_index_sequence | |
C_make_index_sequence< 0 > | |
C_make_index_sequence< 1 > | |
C_mem_invoker | |
C_mem_invoker< F ClassT::*, false > | |
C_mem_invoker< R ClassT::*, true > | |
C_memory_resource_ptr | |
C_memory_resource_ptr_empty | |
C_merge_case_folding | |
C_merge_case_folding< CurrentCaseFolding > | |
C_merge_case_folding< CurrentCaseFolding, H, T... > | |
C_merge_case_folding< void > | |
C_node_char_class_impl | |
C_node_char_class_impl< 0, true, H, T... > | |
C_node_char_class_impl< Idx, true, H, T... > | |
C_nth_type | |
C_nth_type< 0, H, T... > | |
C_nth_type< Idx, H, T... > | |
C_operation_list_of | |
C_proxy_pointer | |
C_string_view_holder | |
C_string_view_holder< FnPtr, index_sequence< Indices... > > | |
C_swar_base | |
C_tuple | |
C_tuple< index_sequence< Idx... >, T... > | |
C_tuple_get_type | |
C_tuple_get_type< T && > | |
C_tuple_holder | |
Call_values_placeholder | |
Cany_base | |
Cany_holder | |
Cascii_set | |
Cascii_set_matcher | |
Cascii_set_matcher< CompressedAsciiSet, index_sequence< RangeIdx... >, index_sequence< SingleIdx... > > | |
Cautomatic_ws_parser | |
Cbasic_string_view | |
Cbidirectional_iterator_base | |
Cbinding_power | |
►Cbuffer_builder | |
Cstable_iterator | |
Ccat_ | |
Ccat_< type_string< CharT, C1... >, type_string< CharT, C2... > > | |
Cchar_class_list | |
Ccompressed_ascii_set | |
Cconcat_seq | |
Cconcat_seq< index_sequence< I1... >, index_sequence< I2... > > | |
Ccontext_finish_parser | |
Ccp_result | |
Cdefault_memory_resource | |
Cdisable_whitespace_skipping | |
Cfinal_parser | |
Cforward_iterator_base | |
Cinteger_sequence | |
Clazy_init | |
Clazy_init< T & > | |
Clazy_init< void > | |
Clit_trie | |
Clit_trie_matcher | |
►Clit_trie_matcher< Trie, CurNode > | |
C_impl | |
C_impl< index_sequence< Idx... > > | |
Cmacro_type_string | |
Cno_bind_state | |
Cnull_terminated | |
Cop_lit_list | |
Coperation_list | |
Cparse_context_control_block | |
Cparse_context_var | |
Cparse_context_var_base | |
Cparsed_operator | |
Cplaceholder_base | |
►Cpt_buffer | |
Cblock | |
Cpt_node | |
Cpt_node_production | |
Cpt_node_token | |
Cscan_final_parser | |
►Cscanner | |
Cerror_recovery_guard | |
Cscanner_input | |
Csentinel_base | |
Cstateless_lambda | |
Cswar_pack_result | |
Cswar_reader_base | |
Ctrace_writer | |
Ctuple | |
Ctuple<> | |
Ctype_string | |
Cvoid_value_callback | |
►Cws_handler | |
Cevent_handler | |
Cws_production | |
Cws_production< lexyd::_wsr< Rule > > | |
►Nparse_events | |
Cbacktracked | |
Cdebug | |
Cerror | |
Cgrammar_cancel | |
Cgrammar_finish | |
Cgrammar_start | |
Coperation_chain_finish | |
Coperation_chain_op | |
Coperation_chain_start | |
Cproduction_cancel | |
Cproduction_finish | |
Cproduction_start | |
Crecovery_cancel | |
Crecovery_finish | |
Crecovery_start | |
Ctoken | |
C_acfr | |
►C_as_aggregate | |
C_sink | |
►C_as_string | |
C_sink | |
C_bit_cast | |
►C_bound_cb | |
C_with_state | |
C_bound_sink | |
►C_br | |
Cmarker | |
C_callback | |
►C_callback_with_state | |
C_with_state | |
C_cb_from_sink | |
C_collect | |
C_collect_sink | |
C_collect_sink< void, Callback > | |
C_collection | |
►C_collection_alloc | |
C_with_state | |
C_collection_sink | |
C_compose_cb | |
C_compose_s | |
C_compose_state | |
C_compose_state< Cb, State, std::enable_if_t< lexy::is_callback_state< Cb, State > > > | |
►C_concat | |
C_sink | |
C_constant | |
C_construct | |
C_construct< void > | |
C_deduce_encoding | |
C_deduce_encoding< char > | |
C_deduce_encoding< char16_t > | |
C_deduce_encoding< char32_t > | |
C_deduce_encoding< std::byte > | |
C_deduce_encoding< unsigned char > | |
C_default | |
C_fn_holder | |
►C_fold | |
C_sink_callback | |
C_fold_sfinae | |
C_fold_sfinae< false > | |
C_fold_sfinae< true > | |
C_fwd | |
C_fwd< void > | |
C_int | |
C_list | |
►C_list_alloc | |
C_with_state | |
C_list_sink | |
C_make_buffer | |
C_make_buffer< utf16_encoding, encoding_endianness::bom > | |
C_make_buffer< utf32_encoding, encoding_endianness::bom > | |
C_make_buffer< utf8_char_encoding, encoding_endianness::bom > | |
C_make_buffer< utf8_encoding, encoding_endianness::bom > | |
C_mem_fn | |
C_mem_fn< MemFn T::* > | |
C_mem_fn_traits | |
C_mem_ptr_fn | |
►C_mh | |
Cevent_handler | |
C_new | |
C_noop | |
C_nth_value | |
C_nth_value< N, T, void > | |
C_nth_value< N, void, Fn > | |
C_nth_value< N, void, void > | |
C_op | |
C_opv | |
C_overloaded | |
C_parse_state | |
C_parse_state< void > | |
C_parse_tree_eof | |
C_partial_input | |
C_pb | |
C_pc | |
C_ph | |
►C_pt_node | |
►Cchildren_range | |
Citerator | |
►Csibling_range | |
Citerator | |
C_pt_node_kind | |
►C_pth | |
Cevent_handler | |
►C_ptr | |
Cmarker | |
C_read_file_user_data | |
►C_rr | |
Cmarker | |
C_scp | |
C_scp< void > | |
C_sfinae_sink | |
C_sign | |
C_sink_wrapper | |
C_subgrammar | |
C_sucfr | |
C_sucfr32 | |
C_sucfrm | |
►C_symbol_table | |
Citerator | |
Ckey_index | |
Cvalue_type | |
►C_th | |
Cevent_handler | |
C_tk_map | |
C_tk_map_empty | |
C_validate_callbacks | |
►C_vh | |
Cevent_handler | |
Cargv_input | |
Cargv_iterator | An iterator over the command-line arguments |
Cargv_sentinel | A sentinel for the command-line arguments |
Cascii_encoding | |
Cbounded | |
►Cbuffer | |
Cbuilder | Allows the creation of an uninitialized buffer that is then filled by the user |
Cbyte_encoding | An encoding where the input is just raw bytes, not characters |
Cbyte_location_counting | Counts bytes for columns, lines end after LineWidth bytes |
Ccfile_output_iterator | |
►Ccode_point | A unicode code point |
C_gc_group | |
Ccode_point_location_counting | Counts code points for columns, newlines for lines |
Ccode_unit_location_counting | Counts code units for columns, newlines for lines |
Ccombination_duplicate | |
Ccontinuation_branch_parser | A branch parser that parses a branch rule but with a special continuation |
Cdefault_encoding | An encoding where the input is some 8bit encoding (ASCII, UTF-8, extended ASCII etc.) |
Cdifferent_identifier | |
Cduplicate_flag | |
Cerror | Generic failure |
Cerror< Reader, expected_char_class > | |
Cerror< Reader, expected_keyword > | |
Cerror< Reader, expected_literal > | |
Cerror< Reader, void > | Type erased generic failure |
Cerror_context | Contains information about the context of an error, production is type-erased |
Cexhausted_choice | |
Cexpected_char_class | Expected a character of the specified character class |
Cexpected_eof | |
Cexpected_keyword | |
Cexpected_literal | Expected the literal character sequence |
Cexpected_literal_set | |
Cexpected_newline | |
Cexpected_production_end | |
Cexpected_token_end | |
Cexpression_production | |
Cfollow_restriction | |
Cforbidden_leading_zero | |
Cinput_line_annotation | |
Cinput_location | A location in the input |
Cinput_location_anchor | Anchor for the location search |
Cinteger_overflow | |
Cinteger_traits | |
Cinteger_traits< bounded< T, Max > > | |
Cinteger_traits< code_point > | |
Cinteger_traits< unbounded< T > > | |
Cinvalid_code_point | |
Cinvalid_code_unit | |
Cinvalid_escape_sequence | |
Clexeme | |
Clexeme_input | |
Clookahead_failure | We've failed to match a lookahead |
Cmatch_action | |
Cmax_operator_nesting_exceeded | |
Cmax_recursion_depth_exceeded | |
Cmember | |
Cminus_sign | |
Cmismatched_byte_count | |
Cmissing_delimiter | The reader ends before the closing delimiter was found |
Cmissing_token | |
Cnullopt | |
Coperator_chain_error | |
Coperator_group_error | |
Cparse_action | |
Cparse_as_tree_action | |
Cparse_result | |
►Cparse_tree | |
►Cbuilder | |
Cmarker | |
►Ctraverse_range | |
C_value_type | |
Citerator | |
Cparse_tree_encoding | |
Cparse_tree_input | |
Cparse_tree_input_traits | |
Cpattern_parser | A parser that does not support any arguments |
Cpeek_failure | We've failed to match a peek |
Cplus_sign | |
Cproduction_info | |
Cproduction_value_callback | |
Crange_input | |
Cread_file_result | |
Creserved_identifier | Error when we matched a reserved |
Crule_scanner | |
Cscan_failed_t | |
Cscan_production | |
Cscan_result | |
Cscan_result< void > | |
Cscanner | |
Csink_finish_parser | A parser that finishes a sink and continues with the next one |
Csink_parser | A parser that forwards all arguments to a sink, which is the first argument |
Cstderr_output_iterator | |
Cstdout_output_iterator | |
Cstring_input | An input that refers to a string |
Csubexpression_production | |
Ctoken | A parsed token, i.e. its kind and its lexeme |
Ctoken_kind | What sort of token it is |
Ctoken_production | |
Ctrace_action | |
Ctransparent_production | |
Cunbounded | |
Cunconditional_branch_parser | A branch parser that takes a branch unconditionally and forwards to the regular parser |
Cunequal_counts | |
Cunexpected | We've failed to match a peek not |
Cunexpected_trailing_separator | |
Cunknown_symbol | |
Cutf16_encoding | An encoding where the input is assumed to be valid UTF-16 |
Cutf32_encoding | An encoding where the input is assumed to be valid UTF-32 |
Cutf8_char_encoding | An encoding where the input is assumed to be valid UTF-8, but the char type is char |
Cutf8_encoding | An encoding where the input is assumed to be valid UTF-8 |
Cvalidate_action | |
Cvalidate_result | |
Cvisualization_options | Options that control visualization |
Cwhitespace_parser | |
Cwhitespace_parser< Context, NextParser, void > | |
►Nlexy_ext | |
►C_filtered_node_range | |
Citerator | |
Csentinel | |
►C_report_error | |
C_sink | |
►Cdefault_prompt | Prompt using stdin and stdout |
Cread_line_callback | |
Cwrite_message_callback | |
Cdiagnostic_writer | Formats and writes diagnostic messages |
Cparse_tree_desc | |
►Cshell | Reads input from an interactive shell |
►Cinput | This is both Reader and Input |
Cmarker | |
Cwriter | |
►Nlexyd | |
►Nascii | |
C_alnum | |
C_alpha | |
C_alphau | |
C_alt | |
C_blank | |
C_cf_dsl | |
C_char | |
C_control | |
C_digit | |
C_graph | |
C_lower | |
C_newline | |
C_one_of | |
C_other_space | |
C_print | |
C_punct | |
C_space | |
C_upper | |
C_word | |
►Nbit | |
C_b | |
C_b0 | |
C_b1 | |
C_bit_pattern | |
C_bit_rule | |
C_n | |
►Nunicode | |
C_alnum | |
C_alpha | |
C_blank | |
C_char | |
C_control | |
C_digit | |
C_graph | |
C_lower | |
C_nctrl | |
C_newline | |
C_other_space | |
C_print | |
C_scf_dsl | |
C_space | |
C_upper | |
C_word | |
C_xid_continue | |
C_xid_start | |
C_xid_start_underscore | |
►C_any | |
Ctp | |
►C_argvsep | |
Ctp | |
►C_b | |
Ctp | |
Ctp< Reader, lexy::_detail::index_sequence< Idx... > > | |
►C_bint | |
C_pc | |
C_pc< NextParser, lexy::_detail::index_sequence< Idx... > > | |
Cbp | |
Cp | |
►C_bits | |
Ctp | |
C_bom | |
C_bom< lexy::utf16_encoding, lexy::encoding_endianness::big > | |
C_bom< lexy::utf16_encoding, lexy::encoding_endianness::little > | |
C_bom< lexy::utf32_encoding, lexy::encoding_endianness::big > | |
C_bom< lexy::utf32_encoding, lexy::encoding_endianness::little > | |
C_bom< lexy::utf8_char_encoding, DontCare > | |
C_bom< lexy::utf8_encoding, DontCare > | |
►C_bounded_integer_parser | |
Cresult_type | |
C_br | |
C_brackets | |
►C_break | |
Cp | |
C_calt | |
C_cand | |
►C_cap | |
Cbp | |
Cp | |
►C_capr | |
C_pc | |
Cbp | |
Cp | |
C_cb | |
C_ccomp | |
C_ccp | |
►C_cfl | |
Ctp | |
C_cfl_folding | |
C_char_class_base | |
►C_chc | |
Cbp | |
Cbp< Reader, lexy::_detail::index_sequence< Idx... > > | |
Cp | |
C_cminus | |
►C_comb | |
Cp | |
C_comb_control | |
►C_comb_it | |
Cp | |
►C_cp | |
C_group_pred | |
C_group_pred< GcGroup > | |
►C_ctx_cadd | |
Cp | |
►C_ctx_ccreate | |
Cp | |
C_ctx_ceq | |
►C_ctx_ceq< H, T... > | |
Cbp | |
Cp | |
►C_ctx_cis | |
Cbp | |
C_ctx_counter_dsl | |
►C_ctx_cpush | |
C_pc | |
Cbp | |
Cp | |
►C_ctx_cvalue | |
Cp | |
►C_ctx_fcreate | |
Cp | |
►C_ctx_fis | |
Cbp | |
C_ctx_flag_dsl | |
►C_ctx_fset | |
Cp | |
►C_ctx_ftoggle | |
Cp | |
►C_ctx_fvalue | |
Cp | |
►C_ctx_icap | |
C_pc | |
►C_ctx_icreate | |
Cp | |
C_ctx_id_dsl | |
►C_ctx_irem | |
Cbp | |
►Cp | |
C_cont | |
C_d | |
C_d< 10 > | |
C_d< 16 > | |
C_d< 2 > | |
C_d< 8 > | |
►C_debug | |
Cp | |
►C_del | |
Cp | |
C_del_chars | |
C_del_limit | |
C_del_limit< void, Error > | |
C_delim_dsl | |
►C_digits | |
Ctp | |
►C_digits_s | |
Ctp | |
►C_digits_st | |
Ctp | |
►C_digits_t | |
Ctp | |
►C_eff | |
Cp | |
C_else | |
C_else_dsl | |
►C_eof | |
Cbp | |
Cp | |
►C_eol | |
Cbp | |
Cp | |
►C_err | |
Cp | |
C_err_production | |
C_escape | |
C_escape_base | |
►C_expr | |
►C_continuation | |
C_op_cont | |
C_state | |
Cp | |
►C_find | |
Cp | |
►C_flag | |
Cp | |
►C_flags | |
Cp | |
►C_id | |
Cbp | |
Cp | |
C_idcp | |
►C_idp | |
Ctp | |
C_idpp | |
C_idrp | |
C_idsp | |
►C_if | |
Cp | |
►C_int | |
C_pc | |
Cbp | |
Cp | |
C_int_dsl | |
C_integer_parser_digits | |
C_integer_parser_digits< T, _digits< Base > > | |
C_integer_parser_digits< T, _digits_s< Base, Sep > > | |
C_integer_parser_digits< T, _digits_st< Base, Sep > > | |
C_integer_parser_digits< T, _digits_t< Base > > | |
C_integer_parser_digits< T, _ndigits< N, Base > > | |
C_integer_parser_digits< T, _ndigits_s< N, Base, Sep > > | |
C_isep | |
C_keyword | |
C_keyword< _id< L, T, R... > > | |
►C_kw | |
Ctp | |
►C_lcp | |
C_string_t | |
Ctp | |
Ctp< Reader, lexy::_detail::index_sequence< Idx... > > | |
►C_lit | |
Ctp | |
C_lit_base | |
►C_look | |
Cbp | |
Cp | |
►C_loop | |
Cp | |
►C_lset | |
Ctp | |
C_lset_base | |
►C_lst | |
Cbp | |
Cp | |
►C_lstt | |
Cp | |
►C_mem | |
Cbp | |
Cp | |
C_mem_dsl | |
C_minus | |
►C_must | |
Cp | |
►C_must_dsl | |
C_err | |
►C_n | |
Ctp | |
►C_ndigits | |
Ctp | |
Ctp< Reader, lexy::_detail::index_sequence< Idx... > > | |
►C_ndigits_s | |
Ctp | |
Ctp< Reader, lexy::_detail::index_sequence< Idx... > > | |
►C_nf | |
Ctp | |
C_nl | |
C_noop_recovery | |
►C_nr | |
C_cont | |
Cbp | |
Cp | |
►C_nsep | |
►Cp | |
C_pc | |
►C_nullopt | |
Cp | |
C_olstt | |
►C_op | |
Cbp | |
Cp | |
►C_opc | |
Cbp | |
Cp | |
C_operation_base | |
►C_opt | |
Cp | |
►C_optt | |
Cp | |
►C_pas | |
Cbp | |
Cp | |
C_pas_final_parser | |
C_pas_handler | |
►C_pb | |
Cbp | |
Cp | |
►C_peek | |
Cbp | |
Cp | |
►C_peekn | |
Cbp | |
Cp | |
C_plus | |
C_pn | |
►C_pos | |
Cp | |
C_pos_dsl | |
►C_posr | |
Cbp | |
Cp | |
►C_prd | |
Cbp | |
Cp | |
C_rec | |
►C_recb | |
C_depth_handler | |
Cbp | |
Cp | |
►C_reco | |
Cp | |
C_recovery_base | |
►C_recovery_wrapper | |
►Cp | |
C_continuation | |
C_rep | |
C_rep_dsl | |
C_rep_impl | |
C_rep_impl< Item, void > | |
►C_repc | |
Cp | |
►C_repd | |
Cp | |
►C_repl | |
Cp | |
C_ret | |
►C_scan | |
Cp | |
C_sep | |
C_sep_base | |
C_seq | |
C_seq_impl | |
C_seq_impl< R1 > | |
C_seq_impl< R1, R2 > | |
C_seq_impl< R1, R2, R3 > | |
C_seq_impl< R1, R2, R3, R4 > | |
C_seq_impl< R1, R2, R3, R4, R5 > | |
C_seq_impl< R1, R2, R3, R4, R5, R6 > | |
C_seq_impl< R1, R2, R3, R4, R5, R6, R7 > | |
C_seq_impl< R1, R2, R3, R4, R5, R6, R7, T... > | |
C_seq_impl<> | |
►C_subg | |
Cp | |
►C_sym | |
Cbp | |
►Cp | |
C_cont | |
►C_sym< Table, _idp< L, T >, Tag > | |
Cbp | |
Cp | |
►C_sym< Table, void, Tag > | |
Cbp | |
Cp | |
C_sym_dsl | |
C_term | |
C_times | |
C_tn | |
►C_toke | |
Ctp | |
►C_token | |
C_production | |
Ctp | |
C_token_base | |
C_token_inherit | |
C_token_inherit< Impl, true > | |
C_token_inherit< Tag, false > | |
C_tokk | |
►C_tryr | |
Cbp | |
Cp | |
►C_tryt | |
C_pc | |
Cp | |
C_tsep | |
►C_unbounded_integer_parser | |
Cresult_type | |
►C_until | |
Ctp | |
►C_until_eof | |
Ctp | |
►C_whl | |
Cp | |
►C_wsn | |
C_pc | |
Cbp | |
Cp | |
►C_wsr | |
Cp | |
C_zero | |
Catom | Operation that just parses the atomic rule |
Cbranch_base | |
►Cchar_class_base | |
Ctp | |
Cgroups | Operation that selects between multiple ones |
Chex_lower | |
Chex_upper | |
Cinfix_op_left | |
Cinfix_op_list | |
Cinfix_op_right | |
Cinfix_op_single | |
Cpostfix_op | |
Cprefix_op | |
Crule_base | |
►Ctoken_base | |
Cbp | |
Cp | |
Cunconditional_branch_base | |
►Nlinb | |
►Cany | |
Crequires_allocation | Whether the type T must be dynamically allocated or can be stored on the stack |
Cstorage_union | |
Cvtable_dynamic | VTable for dynamically allocated storage |
Cvtable_stack | VTable for stack allocated storage |
Cvtable_type | Base VTable specification |
Cbad_any_cast | |
Cin_place_type_t | |
►Nliterals | |
►Nmagic_enum | |
►Ncustomize | |
Ccustomize_t | |
Cenum_range | |
►Ndetail | |
Ccase_insensitive | |
Cenable_if_enum | |
Cenable_if_enum< true, R > | |
Chas_is_flags | |
Chas_is_flags< T, std::void_t< decltype(customize::enum_range< T >::is_flags)> > | |
Cis_reflected | |
Cis_scoped_enum | |
Cis_scoped_enum< T, true > | |
Cis_unscoped_enum | |
Cis_unscoped_enum< T, true > | |
Crange_max | |
Crange_max< T, std::void_t< decltype(customize::enum_range< T >::max)> > | |
Crange_min | |
Crange_min< T, std::void_t< decltype(customize::enum_range< T >::min)> > | |
Cstatic_str | |
Cstatic_str< 0 > | |
Cstr_view | |
Csupported | |
Cunderlying_type | |
Cunderlying_type< T, true > | |
Cvalid_count_t | |
Cis_scoped_enum | |
Cis_unscoped_enum | |
Cunderlying_type | |
►Nnonstd | |
►Ndetail | |
Cin_place_index_tag | |
Cin_place_type_tag | |
Cin_place_t | |
►NSafeAny | |
►CSimpleString | |
CString | |
►Nsqlite | |
►NPriv | |
CStatement | |
CBlob | |
CConnection | |
CError | |
CNOBlob | |
CResult | |
CType | |
►Nstd | |
Chash< nlohmann::NLOHMANN_BASIC_JSON_TPL > | Hash value for JSON objects |
Chash< nonstd::expected< T &, E > > | |
Chash< nonstd::expected< T, E > > | |
Chash< nonstd::expected< void, E > > | |
Cless< ::nlohmann::detail::value_t > | |
Ctuple_element< N, ::nlohmann::detail::iteration_proxy_value< IteratorType > > | |
Ctuple_size<::nlohmann::detail::iteration_proxy_value< IteratorType > > | |
►NTestTypes | |
CPose3D | |
CQuaternion3D | |
CTime | |
CVector3D | |
►Ntinyxml2 | |
CDynArray | |
CEntity | |
CMemPool | |
►CMemPoolT | |
CBlock | |
CItem | |
CStrPair | |
CXMLAttribute | |
CXMLComment | |
CXMLConstHandle | |
CXMLDeclaration | |
►CXMLDocument | |
CDepthTracker | |
CXMLElement | |
CXMLHandle | |
CXMLNode | |
CXMLPrinter | |
CXMLText | |
CXMLUnknown | |
CXMLUtil | |
CXMLVisitor | |
►Nwildcards | |
►Ndetail | |
Cmatch_result | |
Ccards | |
Ccards< char > | |
Ccards< char16_t > | |
Ccards< char32_t > | |
Ccards< wchar_t > | |
Cconst_iterator | |
Ccontainer_item | |
Cfull_match_result | |
Citerated_item | |
Citerator | |
Cmatcher | |
►Nzmq | |
►Ndetail | |
Csocket_base | |
Ccontext_t | |
Cerror_t | |
►Cfrom_handle_t | |
C_private | |
Cmessage_t | |
Cmonitor_t | |
Csocket_ref | |
Csocket_t | |
CAction_A | |
CAction_B | |
CActionEnum | |
CActionVectorDoubleIn | |
CActionVectorStringIn | |
CActionWithMetadata | |
Cadl_serializer | Namespace for Niels Lohmann |
CAssert | |
CBackUpAndSpin | |
Cbasic_json | Namespace for Niels Lohmann |
CBB_TestNode | |
CBB_TypedTestNode | |
CBehaviorTreeTest | |
Cbyte_container_with_subtype | Internal type for a backed binary type |
CCalculateGoal | |
CComparisonNode | |
CComplexFallbackWithMemoryTest | |
CComplexParallelTest | |
CComplexSequence2ActionsTest | |
CComplexSequenceTest | |
CComplexSequenceWithMemoryTest | |
CComputePathToPose | |
CCopyPorts | |
CCoroTestNode | |
CCrossDoor | |
CDeadlineTest | |
CDefaultTestAction | |
CEnvironment | |
CFastAction | |
CFollowPath | |
CGenerateWaypoints | Dummy action that generates a list of poses |
CGetAny | |
CIllegalPorts | |
CIsHealthOk | |
CIsStuck | |
►Cjson_pointer | JSON Pointer defines a string syntax for identifying a specific value within a JSON document |
Cstring_t_helper | |
Cstring_t_helper< NLOHMANN_BASIC_JSON_TPL > | |
Cjson_sax | SAX interface |
CJsonTest | |
CKeepRunning | |
Cmco_coro | |
Cmco_desc | |
CMockedThreadedAction | |
CMockedThreadedActionFixture | |
CModifyPose | |
CMoveBaseAction | |
CMyAction | |
CMyCondition | |
CMyLegacyMoveTo | |
CMyType | |
CNaughtyNav2Node | |
CNoCopyObj | |
CNodeInPorts | |
CNodeOutPorts | |
CNodeStatusFixture | |
CNodeWithDefaultNullptr | |
CNodeWithDefaultPoints | |
CNodeWithDefaultStrings | |
CNodeWithPorts | |
Cordered_map | Minimal map-like container that preserves insertion order |
CPoint | |
CPoint2D | |
CPoint3D | |
CPose2D | |
CPosition2D | |
CPrintEnum | |
CPrintNumber | |
CPrintTarget | |
CPrintToConsole | |
CPrintVector | |
CPushIntoVector | Show how to access an entry in the blackboard by pointer. This approach is more verbose, but thread-safe |
Craw_event | |
CReactiveFallbackTest | |
CReadInConstructor | |
CRefCountClass | |
CRepeatTest | |
CRepeatTestAsync | |
CRetryTest | |
CSampleNode595 | |
CSayRuntimePort | |
CSequenceTripleActionTest | |
CSetAny | |
CSetTask | |
CSimpleCoroAction | |
CSimpleFallbackTest | |
CSimpleFallbackWithMemoryTest | |
CSimpleOutput | |
CSimpleParallelTest | |
CSimpleSequenceTest | |
CSimpleSequenceWithMemoryTest | |
CSwitchTest | |
CTaskA | |
CTaskB | |
CTestNode | |
CTestStruct | |
CThinkRuntimePort | |
CThinkWhatToSay | |
CTimeoutAndRetry | |
CUpdatePosition | |
CUseWaypoint | Simple Action that uses the output of PopFromQueue<Pose2D> or ConsumeQueue<Pose2D> |
CVector4D | |
Czmq_event_t | |