►CBaseNodelet | |
Ccras::NodeletBase< BaseNodelet > | Base template which adds all defined mixins to BaseNodelet class |
►Ccras::NodeletParamHelper< BaseNodelet > | |
Ccras::NodeletBase< BaseNodelet > | Base template which adds all defined mixins to BaseNodelet class |
►Ccras::NodeletWithDiagnostics< BaseNodelet > | |
Ccras::NodeletBase< BaseNodelet > | Base template which adds all defined mixins to BaseNodelet class |
►Ccras::NodeletWithSharedTfBuffer< BaseNodelet > | |
Ccras::NodeletBase< BaseNodelet > | Base template which adds all defined mixins to BaseNodelet class |
►Ccras::StatefulNodelet< BaseNodelet > | |
Ccras::NodeletBase< BaseNodelet > | Base template which adds all defined mixins to BaseNodelet class |
►Ccras::ThreadNameUpdatingNodelet< BaseNodelet > | |
Ccras::NodeletBase< BaseNodelet > | Base template which adds all defined mixins to BaseNodelet class |
►Ctf2::BufferCore [external] | |
►Ctf2_ros::Buffer [external] | |
►Ccras::InterruptibleTFBuffer | Provides overrides of canTransform() that can be interrupted. Normally, canTransform() waits until transform is available, timeout is reached (which may be never in paused simulation), time jumps backwards or ros::ok() returns false. This buffer adds another option of interrupting the call. It also allows "wrapping around" another buffer that does not support this interruptibility and add this ability to it |
Ccras::NodeletAwareTFBuffer | |
►Ctf2_ros::BufferInterface [external] | |
Ctf2_ros::Buffer [external] | |
►Cros::CallbackInterface [external] | |
Ccras::TfMessageFilter< M, >::CBQueueCallback | |
►Cclass_loader::ClassLoader [external] | |
CPreloadingClassLoader< Impl, Base > | This pluginlib classloader alternative can load compiled-in classes and provide them as if they were loaded via the standard pluginlib search mechanism - without even triggering the search |
Ccras::DefaultParamServerType< ResultType > | Default ParamServerType for the given ResultType |
Ccras::DefaultToParamFn< ParamServerType > | Default function for converting XmlRpcValue to an intermediate value of type ParamServerType |
Ccras::DefaultToResultFn< ResultType, ParamServerType > | Default function for converting param server types to result types |
Ccras::DiagnosedPubSub< Message, Enable > | Base for ROS publisher and subscriber with automatic message rate and delay diagnostics |
►Ccras::DiagnosedPubSub< Message > | |
Ccras::DiagnosedPublisher< Message, Enable > | Wrapper for ROS publisher that automatically diagnoses the rate and delay of published messages |
Ccras::DiagnosedSubscriber< Message, Enable > | Wrapper for ROS subscriber that automatically diagnoses the rate and delay of received messages |
►Cdiagnostic_updater::DiagnosticTask [external] | |
Ccras::DurationStatus | Diagnostic task for topic frequency and timestamp delay (combining FrequencyStatus and TimeStampStatus tasks) |
►Cdiagnostic_updater::CompositeDiagnosticTask [external] | |
Ccras::TopicStatus< Message, typename > | Diagnostic task for topic frequency and timestamp delay (combining FrequencyStatus and TimeStampStatus tasks) |
►Cdiagnostic_updater::DiagnosticTaskVector [external] | |
Ccras::OfflineDiagUpdater | |
►Cdiagnostic_updater::Updater [external] | |
Ccras::DiagnosticUpdater | Diagnostic updater that automatically sets its Hardware ID to hostname of the machine |
Ccras::DurationStatusParam | Parameters of DurationStatus diagnostic task |
Ccras::DurationType< T, > | |
Ccras::DurationType< ros::SteadyTime > | |
Ccras::DurationType< ros::Time > | |
Ccras::DurationType< ros::WallTime > | |
►Cfalse_type | |
Ccras::is_any< T > | Type trait determining whether type T is cras::any or not |
Ccras::is_c_string< T > | Type trait for dynamic-sized and constant-sized C strings |
Ccras::is_cras_expected< T > | Type trait determining whether type T is cras::expected or not |
Ccras::is_optional< T > | Type trait determining whether type T is cras::optional or not |
Ccras::is_string< T, typename > | Char trait for a C-string or std::string |
►Cfilters::FilterBase< F > [external] | |
Ccras::FilterBase< F > | |
►Cfilters::FilterChain< F > [external] | |
Ccras::FilterChain< F > | |
Ccras::FilterChainDiagnostics< F > | Diagnostics of performance of a filter chain |
Ccras::FilterGetParamAdapter< F > | |
Ccras::FilterLogHelper< F > | |
►Cdiagnostic_updater::FrequencyStatusParam [external] | |
►Ccras::FrequencyStatusParam | An extension of diagnostic_updater::FrequencyStatusParam that allows passing non-pointer min/max frequency values. If the internal pointers are used, they are correctly handled when copying this object (the new copy will have its own copy of the internal pointers) |
Ccras::TopicStatusParamWithHeader | A combined parameter defining both rate diagnostics and delay diagnostics (for messages with a header) |
Ccras::from_chars_result | |
►Ccras::GetParamAdapter | An adapter that allows getting ROS parameters from various sources |
Ccras::NodeHandleGetParamAdapter | An adapter that allows getting ROS parameters from a node handle |
Ccras::XmlRpcValueGetParamAdapter | |
Ccras::GetParamOptions< ResultType, ParamServerType > | Options specifying behavior of getParam() calls |
Ccras::GetParamResult< T > | Wrapper for the result of a getParam() call. It is designed to autoconvert to the result type sometimes |
Ccras::GetParamResultInfo | Detailed information about the executed getParam() call |
►Ccras::HasLogger | Convenience base class for providing this->log and getCrasLogger() . Just add it as a base to your class and all CRAS_* logging macros should work with the logger from this class |
Ccras::FilterChain< F > | |
►Ccras::ParamHelper | This class provides a unified experience for nodes, nodelets and filters for getting ROS parameter values. Each parameter has to be provided a default value, and each parameter read is logged - specified parameters with INFO verbosity level, defaulted parameters with WARN level. There are also lots of template specializations for builtin ROS types or unsigned values which ease the process of reading the parameters correctly |
►Ccras::BoundParamHelper | Bound param helper (allows omitting the param adapter in each getParam call) |
Ccras::FilterBase< F > | |
►Ccras::NodeParamHelper | This mixin allows calling the getParam() helpers |
►Ccras::NodeHandleWithDiagnostics | Utils for adding diagnostics to a topic via node handle |
Ccras::NodeHandle | |
Ccras::NodeletParamHelper< NodeletType > | This mixin allows calling the getParam() helpers |
►Ccras::NodeletParamHelper< ::nodelet::Nodelet > | |
►Ccras::NodeletBase<::nodelet::Nodelet > | |
►Ccras::Nodelet | |
Ccras::FilterChainNodelet< F > | A versatile nodelet that can load and run a filter chain |
Ccras::NodeletParamHelper< BaseNodelet > | |
Ccras::TfMessageFilter< M, > | Follows the patterns set by the message_filters package to implement a filter which only passes messages through once there is transform data available |
►Ccras::InterruptibleSleepInterface | Interface to an object whose sleep() calls can be interrupted externally. Multiple sleep() calls can be happening at a time. The object waits for the last sleep() call to finish on destruction. No more sleep() calls can be made once destruction of the object started (sleep() will return false in such case). Make sure that ok() returns false when this object is about to be destroyed |
Ccras::InterruptibleTFBuffer | Provides overrides of canTransform() that can be interrupted. Normally, canTransform() waits until transform is available, timeout is reached (which may be never in paused simulation), time jumps backwards or ros::ok() returns false. This buffer adds another option of interrupting the call. It also allows "wrapping around" another buffer that does not support this interruptibility and add this ability to it |
►Ccras::StatefulNodeletInterface | A non-templated interface of the mixin that can tell when a nodelet is being unloaded |
Ccras::StatefulNodelet< NodeletType > | A mixin that can tell when a nodelet is being unloaded |
►Ccras::StatefulNodelet< ::nodelet::Nodelet > | |
Ccras::NodeletBase<::nodelet::Nodelet > | |
Ccras::StatefulNodelet< BaseNodelet > | |
Ccras::LoaderROS | ROS interface for loading/unloading nodelets (internally using nodelet::Loader to do the work) |
►Ccras::LogHelper | This class (reps. its descendants) provides unified access to ROS logging functions, be it ROS_* or NODELET_* |
Ccras::MemoryLogHelper | |
►Ccras::RosconsoleLogHelper | Log helper relaying all of its work to the same mechanism used by ROS_* logging macros |
Ccras::NodeletLogHelper | |
Ccras::NodeLogHelper | |
Ccras::WrapperLogHelper | |
►Ctf2_ros::MessageFilterBase [external] | |
Ccras::TfMessageFilter< M, > | Follows the patterns set by the message_filters package to implement a filter which only passes messages through once there is transform data available |
Ccras::TfMessageFilter< M, >::MessageInfo | |
►Cros::NodeHandle [external] | |
Ccras::NodeParamHelper | This mixin allows calling the getParam() helpers |
►Cnodelet::Nodelet [external] | |
Ccras::NodeletWithSharedTfBuffer< NodeletType > | A nodelet mixin that allows to use a tf2_ros::Buffer provided by the nodelet manager (which should save some computations). If this nodelet has also the StatefulNodelet mixin, the automatically created non-shared buffer is nodelet-aware (you can also pass a NodeletAwareTfBuffer to setBuffer() ). That means any TF lookups done via this->getBuffer() will be able to correctly end when the nodelet is being unloaded (which normally hangs: https://github.com/ros/geometry2/issues/381) |
Ccras::StatefulNodelet< NodeletType > | A mixin that can tell when a nodelet is being unloaded |
Ccras::ThreadNameUpdatingNodelet< NodeletType > | This mixin allows the nodelet to update the OS name of the thread in which it is currently executing |
Ccras::NodeletBase<::nodelet::Nodelet > | |
Ccras::NodeletParamHelper< ::nodelet::Nodelet > | |
►Ccras::NodeletWithDiagnostics< ::nodelet::Nodelet > | |
Ccras::NodeletBase<::nodelet::Nodelet > | |
►Ccras::NodeletWithSharedTfBuffer< ::nodelet::Nodelet > | |
Ccras::NodeletBase<::nodelet::Nodelet > | |
Ccras::StatefulNodelet< ::nodelet::Nodelet > | |
►Ccras::ThreadNameUpdatingNodelet< ::nodelet::Nodelet > | |
Ccras::NodeletBase<::nodelet::Nodelet > | |
►Ccras::NodeletManager | Nodelet manager with customizable instance creation mechanism |
Ccras::NodeletManagerSharingTfBuffer | A nodelet manager that can share its TF buffer with cras::NodeletWithSharedTfBuffer nodelets |
►CNodeletType | |
Ccras::NodeletParamHelper< NodeletType > | This mixin allows calling the getParam() helpers |
Ccras::NodeletWithDiagnostics< NodeletType > | Nodelet mixin that provides helper functions for running a diagnostics updater |
►Ccras::NodeletWithSharedTfBufferInterface | Public non-template API of NodeletWithSharedTfBuffer. Dynamic_cast a nodelet to this type if you need to access this API publicly |
Ccras::NodeletWithSharedTfBuffer< NodeletType > | A nodelet mixin that allows to use a tf2_ros::Buffer provided by the nodelet manager (which should save some computations). If this nodelet has also the StatefulNodelet mixin, the automatically created non-shared buffer is nodelet-aware (you can also pass a NodeletAwareTfBuffer to setBuffer() ). That means any TF lookups done via this->getBuffer() will be able to correctly end when the nodelet is being unloaded (which normally hangs: https://github.com/ros/geometry2/issues/381) |
Ccras::NodeletWithSharedTfBuffer< ::nodelet::Nodelet > | |
Ccras::NodeletWithSharedTfBuffer< BaseNodelet > | |
Ccras::ParamToStringFn< T > | Default function for converting values to string in getParam(Verbose) functions. Uses cras::to_string() |
►Ccras::RateLimiter | Generic rate-limiter interface |
Ccras::ThrottleLimiter | The (not so clever) algorithm used by topic_tools/throttle node |
Ccras::TokenBucketLimiter | Token bucket rate limiting algorithm |
►Ccras::Resettable | Interface for resettable nodes and nodelets |
►Ccras::TimeJumpResettable | Interface for resettable nodes and nodelets. Automatic reset on time jumps |
Ccras::NodeletManagerSharingTfBuffer | A nodelet manager that can share its TF buffer with cras::NodeletWithSharedTfBuffer nodelets |
Ccras::NodeletWithSharedTfBuffer< NodeletType > | A nodelet mixin that allows to use a tf2_ros::Buffer provided by the nodelet manager (which should save some computations). If this nodelet has also the StatefulNodelet mixin, the automatically created non-shared buffer is nodelet-aware (you can also pass a NodeletAwareTfBuffer to setBuffer() ). That means any TF lookups done via this->getBuffer() will be able to correctly end when the nodelet is being unloaded (which normally hangs: https://github.com/ros/geometry2/issues/381) |
Ccras::NodeletWithSharedTfBuffer< ::nodelet::Nodelet > | |
Ccras::NodeletWithSharedTfBuffer< BaseNodelet > | |
Ccras::ReverseSemaphore | A reverse counting semaphore which can wait until its count is zero. Each acquire() increases this count and each release() decreases it. waitZero() is the function that waits until the internal count is zero. The semaphore can be disabled, which means no new acquire() calls will be accepted. This is useful if you plan to quit |
Ccras::RunningStats< T > | Computation of running average and variance using Welford's algorithm |
Ccras::RunningStats< ros::Duration > | |
►Cruntime_error | |
Ccras::GetParamException | Exception thrown when conversion of a parameter fails during getParam() if option throwIfConvertFails is true or when a missing parameter is required |
Ccras::SemaphoreGuard< T > | RAII guard for operations with a semaphore. On creation, the semaphore is acquired, and on destruction, it is released |
Ccras::SimpleDurationStatusParam | Helper struct for easy brace-initialization of DurationStatusParam objects. On supported compilers, you can also use designated braced initialization, i.e. param = {.maxDuration = {10,0}} . Supported is e.g. GCC 8+ in any mode or any compiler in C++20 mode |
►Cmessage_filters::SimpleFilter< M > [external] | |
Ccras::TfMessageFilter< M, > | Follows the patterns set by the message_filters package to implement a filter which only passes messages through once there is transform data available |
Ccras::SimpleTopicStatusParamNoHeader | Helper struct for easy brace-initialization of TopicStatusParam objects. On supported compilers, you can also use designated braced initialization, i.e. param = {.maxRate = 10} . Supported is e.g. GCC 8+ in any mode or any compiler in C++20 mode |
Ccras::SimpleTopicStatusParamWithHeader | Helper struct for easy brace-initialization of TopicStatusParam objects. On supported compilers, you can also use designated braced initialization, i.e. param = {.maxRate = 10} . Supported is e.g. GCC 8+ in any mode or any compiler in C++20 mode |
Ccras::SmallMap< K, V > | Simple map implemented on top of a std::list<std::pair>. The map is append-only, with lock-free reads and mutex-protected insert |
Ccras::SmallSet< K > | Simple set implemented on top of a std::list. The set is append-only, with lock-free reads and mutex-protected insert |
Ccras::TempLocale | Helper class for temporarily setting locale in a RAII manner |
►Cdiagnostic_updater::TimeStampStatusParam [external] | |
Ccras::TopicStatusParamWithHeader | A combined parameter defining both rate diagnostics and delay diagnostics (for messages with a header) |
Ccras::TopicStatusParams | Utility class with various predefined topic diagnostic parameters |
►Ctrue_type | |
Ccras::is_any<::cras::any > | Type trait determining whether type T is cras::any or not |
Ccras::is_c_string< char * > | |
Ccras::is_c_string< char *const > | |
Ccras::is_c_string< char[I]> | |
Ccras::is_c_string< const char * > | |
Ccras::is_c_string< const char *const > | |
Ccras::is_c_string< const char[I]> | |
Ccras::is_cras_expected<::cras::expected< T, E > > | Type trait determining whether type T is cras::optional or not |
Ccras::is_optional<::cras::optional< T > > | Type trait determining whether type T is cras::optional or not |
Ccras::is_string< T, ::std::enable_if_t<::cras::is_c_string< typename std::decay< T >::type >::value > > | |
Ccras::is_string< T, ::std::enable_if_t<::std::is_same< typename std::decay< T >::type, ::std::string >::value > > | |
Ccras::XmlRpcValueTraits< T, class > | Type traits for XmlRpcValue |
Ccras::XmlRpcValueTraits< bool > | |
Ccras::XmlRpcValueTraits< char * > | |
Ccras::XmlRpcValueTraits< char > | |
Ccras::XmlRpcValueTraits< const char * > | |
Ccras::XmlRpcValueTraits< double > | |
Ccras::XmlRpcValueTraits< float > | |
Ccras::XmlRpcValueTraits< int > | |
Ccras::XmlRpcValueTraits< long > | |
Ccras::XmlRpcValueTraits< long double > | |
Ccras::XmlRpcValueTraits< long long > | |
Ccras::XmlRpcValueTraits< short > | |
Ccras::XmlRpcValueTraits< signed char > | |
Ccras::XmlRpcValueTraits< typename ::XmlRpc::XmlRpcValue::BinaryData > | |
Ccras::XmlRpcValueTraits< unsigned char > | |
Ccras::XmlRpcValueTraits< unsigned int > | |
Ccras::XmlRpcValueTraits< unsigned long > | |
Ccras::XmlRpcValueTraits< unsigned long long > | |
Ccras::XmlRpcValueTraits< unsigned short > | |
Ccras::XmlRpcValueTraits<::std::array< T, N >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::std::list< T >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::std::map<::std::string, T >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::std::set< T >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::std::string > | |
Ccras::XmlRpcValueTraits<::std::unordered_map<::std::string, T >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::std::unordered_set< T >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::std::vector< T >, typename ::std::enable_if<::cras::XmlRpcValueTraits< T >::xmlRpcType !=::XmlRpc::XmlRpcValue::TypeInvalid >::type > | |
Ccras::XmlRpcValueTraits<::tm > | |