Namespaces | Classes | Typedefs | Enumerations | Functions | Variables
ecl Namespace Reference

Namespaces

 blueprints
 
 command_line
 
 concepts
 
 containers
 
 devices
 
 formatters
 
 geometry
 
 interfaces
 
 mobile_robot
 
 MultiArgHelper
 
 odometry
 
 threads
 
 time
 
 ValueArgHelper
 

Classes

class  Angle
 Parent template definition for angles.
 
class  Angle< T, enable_if< is_float< T > >::type >
 Interface for angular measurements.
 
class  Arg
 Virtual parent for all the different argument classes.
 
class  ArgException
 Defines the exception that is thrown whenever a command line is created and parsed.
 
class  ArgParseException
 Defines the exception that is thrown when an argument is improperly parsed.
 
class  Array
 Fixed size container with a few bells and whistles.
 
class  Array< Type, DynamicStorage >
 Dynamic size container with a few bells and whistles.
 
class  BinaryFunction
 Virtual interface definition for binary function objects.
 
class  BluePrint
 This is a parent template for blueprints using crtp.
 
class  BluePrintConcept
 Defines validating functionality for the blueprint concept.
 
class  BluePrintFactory
 Primary template for blueprint factories.
 
class  BluePrintFactory< Array< Type, DynamicStorage > >
 Blueprint factory for dynamic arrays.
 
class  BluePrintFactory< CubicPolynomial >
 Blueprint factory for cubic polynomials.
 
class  BluePrintFactory< CubicSpline >
 Blueprint factory for cubic splines.
 
class  BluePrintFactory< LinearFunction >
 Blueprint factory for linear functions.
 
class  BluePrintFactory< Polynomial< N > >
 Primary template for the Polynomial blueprint factories.
 
class  BluePrintFactory< QuinticPolynomial >
 Blueprint factory for quintic polynomials.
 
class  BluePrintFactory< TensionFunction >
 Blueprint factory for tension functions.
 
class  BluePrintFactory< TensionSpline >
 Blueprint factory for tension splines.
 
class  Bool
 Integral constant wrapper for boolean values.
 
class  BoundNullaryMemberFunction
 Nullary function object for bound nullary member functions.
 
class  BoundNullaryMemberFunction< C, void >
 Specialisation of the bound nullary member function for void functions.
 
class  BoundUnaryFreeFunction
 Nullary function object for bound unary global/static functions.
 
class  BoundUnaryFreeFunction< A, void >
 Specialisation for bound void unary functions.
 
class  BoundUnaryMemberFunction
 Nullary function object for bound unary member functions.
 
class  ByteContainerConcept
 Defines validating functionality for the byte container concept.
 
class  CartesianPoint
 Generic container storing a cartesian point of dimension N.
 
class  CartesianPoint< T, 2 >
 Specialisation for a cartesian point of dimension 2.
 
class  CartesianPoint< T, 3 >
 Specialisation for a cartesian point of dimension 3.
 
class  ClearScreen
 Manipulator that clears a terminal screen the c++ (hard) way. More...
 
class  CmdLine
 Manages the command line parsing object.
 
class  CmdLineInterface
 Managing interface for The base class that manages the command line definition and passes along the parsing to the appropriate Arg classes.
 
class  CmdLineOutput
 Tclap class indirectly used by children for standardising outputs.
 
class  CmdLineParseException
 Defines the exception when an argument is improperly specified.
 
class  Constraint
 Defines the interaction between an argument and a constraint.
 
class  ContainerConcept
 Defines validating functionality for the container concept.
 
class  Converter
 Primary template and general fallback for converter classes.
 
class  Converter< Array< char >, Integral >
 Specialisation for integral to char Array conversions.
 
class  Converter< Array< signed char >, Integral >
 Specialisation for integral to signed char Array conversions.
 
class  Converter< Array< unsigned char >, Integral >
 Specialisation for integral to signed char Array conversions.
 
class  Converter< char *, bool >
 Fast conversion to text format with character strings.
 
class  Converter< char *, char >
 Fast conversion to text format with character strings.
 
class  Converter< char *, double >
 Fast conversion to text format with character strings.
 
class  Converter< char *, float >
 Conversion to text format with character strings.
 
class  Converter< char *, int >
 Fast conversion to text format with character strings.
 
class  Converter< char *, long >
 Fast conversion to text format with character strings.
 
class  Converter< char *, long long >
 Fast conversion to text format with character strings.
 
class  Converter< char *, short >
 Fast conversion to text format with character strings.
 
class  Converter< char *, unsigned char >
 Fast conversion to text format with character strings.
 
class  Converter< char *, unsigned int >
 Fast conversion to text format with character strings.
 
class  Converter< char *, unsigned long >
 Fast conversion to text format with character strings.
 
class  Converter< char *, unsigned long long >
 Fast conversion to text format with character strings.
 
class  Converter< char *, unsigned short >
 Fast conversion to text format with character strings.
 
class  Converter< char *, void >
 Family of converters to character strings.
 
class  Converter< char, int >
 Converts ints into readable (ascii) characters.
 
class  Converter< char, unsigned int >
 Converts unsigned ints into readable (ascii) characters.
 
class  Converter< char, void >
 Family of converters to char.
 
class  Converter< Eigen::Vector3f, Sophus::SE3f >
 Converter class representing the Sophus::toPose2D method.
 
class  Converter< int, char * >
 Conversion from a char array to an integer type.
 
class  Converter< int, char >
 Conversion from a char to an integer type.
 
class  Converter< int, std::string >
 Conversion from a string to an integer type.
 
class  Converter< int, unsigned char * >
 Conversion from a byte array to an integer type.
 
class  Converter< int, void >
 Conversions to integers.
 
class  Converter< Integral, Array< char, Size > >
 Specialisation for char Array container based FromByteArray converter.
 
class  Converter< Integral, Array< signed char, Size > >
 Specialisation for signed char Array container based FromByteArray converter.
 
class  Converter< Integral, Array< unsigned char, Size > >
 Specialisation for the unsigned char Array container based FromByteArray converter.
 
class  Converter< Integral, std::vector< char > >
 Specialisation for the vector<char> container based FromByteArray converter.
 
class  Converter< Integral, std::vector< signed char > >
 Specialisation for the vector<signed char> container based FromByteArray converter.
 
class  Converter< Integral, std::vector< unsigned char > >
 Specialisation for the vector<unsigned char> container based FromByteArray converter.
 
class  Converter< Integral, Stencil< Array< char, Size > > >
 Specialisation for char Stencil container based FromByteArray converter.
 
class  Converter< Integral, Stencil< Array< signed char, Size > > >
 Specialisation for signed char Stencil container based FromByteArray converter.
 
class  Converter< Integral, Stencil< Array< unsigned char, Size > > >
 Specialisation for unsigned char Stencil container based FromByteArray converter.
 
class  Converter< Integral, Stencil< const unsigned char * > >
 Specialisation for const unsigned char* Stencil container based FromByteArray converter.
 
class  Converter< Output, void >
 Primary template for the output-designated only converters.
 
class  Converter< Sophus::SE3f, Eigen::Vector3f >
 Converter class representing the Sophus::toPose3D method.
 
class  Converter< std::string, int >
 Converts int to string, convenient but slow.
 
class  Converter< std::string, void >
 Convenient, but slow conversions to text format with strings.
 
class  Converter< std::vector< char >, char * >
 Converts a char string of human readable hexes to a byte array.
 
class  Converter< std::vector< char >, int >
 Converts int to a byte array of chars.
 
class  Converter< std::vector< char >, long >
 Converts long to a byte array of chars.
 
class  Converter< std::vector< char >, long long >
 Converts long long to a byte array of chars.
 
class  Converter< std::vector< char >, unsigned int >
 Converts unsigned int to a byte array of chars.
 
class  Converter< std::vector< char >, unsigned long >
 Converts unsigned long to a byte array of chars.
 
class  Converter< std::vector< char >, void >
 Family of converters to byte arrays of vector<char> type.
 
class  Converter< std::vector< signed char >, int >
 Converts int to a byte array of signed chars.
 
class  Converter< std::vector< signed char >, long >
 Converts long to a byte array of signed chars.
 
class  Converter< std::vector< signed char >, long long >
 Converts long long to a byte array of signed chars.
 
class  Converter< std::vector< signed char >, unsigned int >
 Converts unsigned int to a byte array of signed chars.
 
class  Converter< std::vector< signed char >, unsigned long >
 Converts unsigned long to a byte array of signed chars.
 
class  Converter< std::vector< signed char >, void >
 Family of converters to byte arrays of vector<signed char> type.
 
class  Converter< std::vector< unsigned char >, int >
 Converts int to a byte array of unsigned chars.
 
class  Converter< std::vector< unsigned char >, long >
 Converts long to a byte array of unsigned chars.
 
class  Converter< std::vector< unsigned char >, long long >
 Converts long long to a byte array of unsigned chars.
 
class  Converter< std::vector< unsigned char >, unsigned int >
 Converts unsigned int to a byte array of unsigned chars.
 
class  Converter< std::vector< unsigned char >, unsigned long >
 Converts unsigned long to a byte array of unsigned chars.
 
class  Converter< std::vector< unsigned char >, void >
 Family of converters to byte arrays of vector<unsigned char> type.
 
class  Converter< Stencil< Array< char, Size > >, Integral >
 Specialisation for integral to char Stencil conversions.
 
class  Converter< Stencil< Array< signed char, Size > >, Integral >
 Specialisation for integral to signed char Stencil conversions.
 
class  Converter< Stencil< Array< unsigned char, Size > >, Integral >
 Specialisation for integral to unsigned char Stencil conversions.
 
class  Converter< Stencil< std::vector< unsigned char > >, int >
 Specialisation for int to vector based unsigned char Stencil container.
 
class  Converter< Stencil< std::vector< unsigned char > >, long >
 Specialisation for long to vector based unsigned char Stencil container.
 
class  Converter< Stencil< std::vector< unsigned char > >, long long >
 Specialisation for long long to vector based unsigned char Stencil container.
 
class  Converter< Stencil< std::vector< unsigned char > >, unsigned int >
 Specialisation for unsigned int to vector based unsigned char Stencil container.
 
class  CubicSpline
 Storage container for a cubic spline interpolation.
 
class  DataException
 Extended exception class that bundles location, message and data.
 
class  DifferentialDrive
 Differential drive properties and algorithms.
 
class  Division
 Primary template functor for polynomial division.
 
class  Division< CubicPolynomial >
 Synthetic division between cubic and a factor.
 
class  Division< QuadraticPolynomial >
 Synthetic division between quadratic and a factor.
 
class  DocBookOutput
 TClap class used for generating docbook output.
 
class  DynamicContainerConcept
 Defines validating functionality for the dynamic container concept.
 
struct  ecl_traits
 Forward declaration for a general purpose traits mechanims.
 
class  ecl_traits< LegacyPose2D< Float, RotationAngleStorage, Enable > >
 
class  ecl_traits< LegacyPose2D< Float, RotationMatrixStorage, Enable > >
 
class  ecl_traits< LegacyPose2D< Float, Storage, Enable > >
 
class  ecl_traits< Pose2D< Float, RotationAngleStorage, Enable > >
 Traits for the pose2D class with scalar angle storage. More...
 
class  ecl_traits< Pose2D< Float, RotationMatrixStorage, Enable > >
 Traits for the pose2D class with rotation matrix storage. More...
 
class  ecl_traits< Pose2D< Float, Storage, Enable > >
 Parent template for ecl traits of the pose classes. More...
 
class  EConsole
 Device for writing o standard error.
 
struct  enable_if
 Enables the SFINAE concept.
 
struct  enable_if_c
 Conditional class for (true) implementation of enable_if.
 
struct  enable_if_c< false, T >
 Conditional class for (false) implementation of enable_if.
 
class  EndOfLine
 Replicates the well known end of line/flush combination. More...
 
class  Error
 The primary error handler for ecl libraries.
 
class  EuclideanNorm
 Functor for euclidean norms.
 
class  Exception
 Virtual parent class for the ecl exceptions.
 
class  FailedObject
 An object designed to fail with compile time error upon instantiation.
 
class  FiFo
 Really simple fifo implementation.
 
class  Flags
 Convenience class for organising boolean flags.
 
class  Format
 Primary template for all formatter classes.
 
class  Format< char >
 Formatter for char types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< double >
 Formatter for double types.
 
class  Format< float >
 Formatter for float types.
 
class  Format< int >
 Formatter for int types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< long >
 Formatter for long types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< short >
 Formatter for short types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< signed char >
 Formatter for signed char types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< Sophus::SE3f >
 
class  Format< std::string >
 Formatter for string types.
 
class  Format< unsigned char >
 Formatter for unsigned char types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< unsigned int >
 Formatter for unsigned int types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< unsigned long >
 Formatter for unsigned long types. It is a specialisation of the Format<IntegralNumber> class.
 
class  Format< unsigned short >
 Formatter for unsigned short types. It is a specialisation of the Format<IntegralNumber> class.
 
struct  FrequencyDiagnostics
 Data relevant to frequencies of an incoming stream.
 
class  FrequencyMonitor
 Lightweight and fast frequency monitor.
 
class  FunctionMath
 Used as a parent to load function math into function classes.
 
class  FunctionMath< CubicPolynomial >
 Specialises the function math loader for cubics.
 
class  FunctionMath< LinearFunction >
 Specialises the function math loader for linear functions.
 
class  FunctionMath< QuadraticPolynomial >
 Specialises the function math loader for quadratics.
 
class  GenericSplineFunction
 This is a parent class for generic spline functions.
 
class  HelpVisitor
 TClap class indirectly used to define the interface for visitors.
 
class  HomogeneousPoint
 Dummy parent class for Homogenous points.
 
class  HomogeneousPoint< T, typename ecl::enable_if< ecl::is_float< T > >::type >
 Container storing a homogenous point.
 
class  IConsole
 Device for reading from standard output.
 
struct  if_c
 The metaprogramming equivalent of the 'if' function.
 
struct  if_c< false, T1, T2 >
 Specialisation of the metaprogrammed 'if' statement when false.
 
class  IgnoreRestVisitor
 TClap class indirectly used to define the interface for visitors.
 
class  InputByteDeviceConcept
 Validates functionality for the input byte device concept.
 
class  InputCharDeviceConcept
 Validates functionality for the input char device concept.
 
class  InputOutputByteDeviceConcept
 Validates functionality for the input-output byte device concept.
 
class  InputOutputCharDeviceConcept
 Validates functionality for the input-output char device concept.
 
class  Intersection
 Primary template functor for the intersection of like functions.
 
class  Intersection< LinearFunction >
 Intersection of two linear functions.
 
class  is_byte
 Default action for detection of a fundamental byte type (false).
 
class  is_byte< char >
 Byte trait for char types.
 
class  is_byte< signed char >
 Byte trait for signed char types.
 
class  is_byte< unsigned char >
 Byte trait for unsigned char types.
 
class  is_float
 Default action for detection of a fundamental float type (false).
 
class  is_float< double >
 Float trait for double types.
 
class  is_float< float >
 Float trait for float types.
 
class  is_float< long double >
 Float trait for long double types.
 
class  is_integral
 Default action for detection of a fundamental integral type (false).
 
class  is_integral< char >
 Integral trait for char types.
 
class  is_integral< int >
 Integral trait for int types.
 
class  is_integral< long >
 Integral trait for long types.
 
class  is_integral< long long >
 Integral trait for long long types.
 
class  is_integral< short >
 Integral trait for short types.
 
class  is_integral< unsigned char >
 Integral trait for unsigned char types.
 
class  is_integral< unsigned int >
 Integral trait for unsigned int types.
 
class  is_integral< unsigned long >
 Integral trait for unsigned long types.
 
class  is_integral< unsigned long long >
 Integral trait for unsigned long long types.
 
class  is_integral< unsigned short >
 Integral trait for unsigned short types.
 
class  is_reference_wrapper
 Default action for detection of the reference wrapper type trait (false).
 
class  is_reference_wrapper< ReferenceWrapper< T > >
 Configures the reference wrapper type trait for the ReferenceWrapper specialisation to true.
 
class  is_seekable
 Default action for detection of seekable devices (false).
 
class  is_signed
 Default action for detection of a signed integral type (false).
 
class  is_signed< char >
 Unsigned trait for signed char types.
 
class  is_signed< int >
 Unsigned trait for signed int types.
 
class  is_signed< long >
 Unsigned trait for signed long types.
 
class  is_signed< long long >
 Unsigned trait for signed long long types.
 
class  is_signed< short >
 Unsigned trait for signed short types.
 
class  is_signed_byte
 Default action for detection of a fundamental signed byte type (false).
 
class  is_signed_byte< char >
 Signed byte trait for char types if typedef'd to signed char.
 
class  is_signed_byte< signed char >
 Signed byte trait for signed char types.
 
class  is_sink
 Default action for detection of sink devices (output) (false).
 
class  is_sink< EConsole >
 Error console sink (output device) trait.
 
class  is_sink< OConsole >
 Console sink (output device) trait.
 
class  is_sink< SharedFile >
 File sink (output device) trait.
 
class  is_sink< String >
 String sink (output device) trait.
 
class  is_source
 Default action for detection of source devices (input) (false).
 
class  is_source< IConsole >
 Console source (input device) trait.
 
class  is_source< String >
 String sink (input device) trait.
 
class  is_sourcesink
 Default action for detection of source-sink devices (input-output) (false).
 
class  is_sourcesink< String >
 String sourcesink (input-output device) trait.
 
class  is_unsigned
 Default action for detection of an unsigned integral type (false).
 
class  is_unsigned< unsigned char >
 Unsigned trait for unsigned char types.
 
class  is_unsigned< unsigned int >
 Unsigned trait for unsigned int types.
 
class  is_unsigned< unsigned long >
 Unsigned trait for unsigned long types.
 
class  is_unsigned< unsigned long long >
 Unsigned trait for unsigned long long types.
 
class  is_unsigned< unsigned short >
 Unsigned trait for unsigned short types.
 
class  is_unsigned_byte
 Default action for detection of a fundamental unsigned byte type (false).
 
class  is_unsigned_byte< char >
 Unsigned byte trait for char types if typedef'd to unsigned char.
 
class  is_unsigned_byte< unsigned char >
 Unsigned byte trait for unsigned char types.
 
class  LegacyPose2D
 
class  LegacyPose2D< Float, Storage, enable_if< is_float< Float > >::type >
 
class  LegacyPose3D
 
class  LegacyPose3D< Float, enable_if< is_float< Float > >::type >
 
class  LinearSegment
 
class  LogStream
 A customised textstream for fast, multithreaded logging to file. More...
 
class  Manipulator
 Parent template for c++ style stream manipulators. More...
 
class  Maximum
 Primary template functor for the maximum of a continuous function.
 
class  Maximum< CubicPolynomial >
 Mathematical maximum on a compact interval for cubic polynomials.
 
class  Maximum< LinearFunction >
 Mathematical maximum on a compact interval for linear functions.
 
class  Minimum
 Primary template functor for the minimum of a continuous function.
 
class  Minimum< CubicPolynomial >
 Mathematical minimum on a compact interval for cubic polynomials.
 
class  Minimum< LinearFunction >
 Mathematical minimum on a compact interval for linear functions.
 
class  MultiArg
 
class  MultiSwitchArg
 
class  NullaryFreeFunction
 Nullary function object for void global/static functions.
 
class  NullaryFreeFunction< void >
 Specialisation for free nullary functions that return void.
 
class  NullaryFunction
 Virtual interface definition for nullary function objects.
 
class  NullaryFunctionConcept
 Defines validating functionality for the nullary function concept.
 
class  NullaryFunctionCopy
 Create a NullaryFunction object composited from an existing function object.
 
class  NullaryFunctionCopy< FunctionObject, void >
 Specialisation of NullaryFunctionCopy for void return types.
 
class  NullaryFunctionReference
 Creates a nullary function from a reference wrapper.
 
class  NullaryFunctionReference< FunctionObject, void >
 Creates a void nullary function from a reference wrapper.
 
class  NullaryMemberFunction
 Unary function object for member functions without arguments.
 
class  NullaryMemberFunction< C, void >
 Specialisation of the unary function object for void member functions without arguments.
 
class  numeric_limits
 Expands the std numeric_limits class.
 
class  numeric_limits< char >
 Expands the std numeric_limits class for char.
 
class  numeric_limits< double >
 Expands the std numeric_limits class for float.
 
class  numeric_limits< float >
 Expands the std numeric_limits class for float.
 
class  numeric_limits< int >
 Expands the std numeric_limits class for int.
 
class  numeric_limits< long >
 Expands the std numeric_limits class for long.
 
class  numeric_limits< long double >
 Expands the std numeric_limits class for float.
 
class  numeric_limits< long long >
 Expands the std numeric_limits class for long long.
 
class  numeric_limits< short >
 Expands the std numeric_limits class for short.
 
class  numeric_limits< unsigned char >
 Expands the std numeric_limits class for unsigned char.
 
class  numeric_limits< unsigned int >
 Expands the std numeric_limits class for unsigned int.
 
class  numeric_limits< unsigned long >
 Expands the std numeric_limits class for unsigned long.
 
class  numeric_limits< unsigned long long >
 Expands the std numeric_limits class for unsigned long long.
 
class  numeric_limits< unsigned short >
 Expands the std numeric_limits class for unsigned short.
 
class  OConsole
 Device for writing to standard output.
 
class  OFileStream
 Convenience class for OFile TextStream definitions. More...
 
class  OptionalUnlabeledTracker
 
class  OutputByteDeviceConcept
 Validates functionality for the output byte device concept.
 
class  OutputCharDeviceConcept
 Validates functionality for the output char device concept.
 
class  Parameter
 General parameter type for member variables of a pre-specified class.
 
class  PartiallyBoundBinaryMemberFunction
 Binary function object for partially bound binary member functions.
 
class  PartiallyBoundUnaryMemberFunction
 Unary function object for partially bound unary member functions.
 
class  PascalsTriangle
 Holds the coefficients for pascal's triangle up to row N.
 
class  PascalsTriangle< 3 >
 Holds the coefficients of pascal's triangle up to n = 3.
 
class  PascalsTriangle< 5 >
 Holds the coefficients of pascal's triangle up to n = 5.
 
class  Polynomial
 Representation of a polynomial function of n-th degree.
 
class  Polynomial< 0 >
 Specialisation for the zero-th order polynomial.
 
class  Pose2D
 Parent template definition for Pose2D. More...
 
class  Pose2D< Float, Storage, enable_if< is_float< Float > >::type >
 Representation for a 2D pose (3 degrees of freedom). More...
 
class  Pose3D
 Parent template definition for Pose3D. More...
 
class  Pose3D< Float, enable_if< is_float< Float > >::type >
 Representation for a 3D pose (6 degrees of freedom). More...
 
class  PosixErrorHandler
 Provides c++ mechanisms for handling posix errors.
 
struct  PrecisionWidth
 Precision width trait for fundamental types.
 
struct  PrecisionWidth< double >
 Precision width trait for doubles.
 
struct  PrecisionWidth< float >
 Precision width trait for floats.
 
class  PushAndPop
 Surpport push and pack operation.
 
class  PushAndPop< Type, DynamicStorage >
 Surpport push and pack operation.
 
class  RandomNumberGenerator
 A random number generator.
 
class  ReferenceWrapper
 Provides a wrapper which allows the original object to be passed like a reference.
 
class  Roots
 Primary template functor for the roots of a function (x-axis intercepts).
 
class  Roots< CubicPolynomial >
 X axis intercepts for cubic polynomials.
 
class  Roots< LinearFunction >
 X axis intercepts for linear functions.
 
class  Roots< QuadraticPolynomial >
 X axis intercepts for quadratics.
 
class  SerialStream
 Convenience class for Serial TextStream definitions. More...
 
class  SharedFile
 Multi-instance (also thread-safe) output file device.
 
class  SharedFileStream
 Convenience class for SharedFile TextStream definitions. More...
 
class  Signal
 Signalling component of a callback system.
 
class  Signal< Void >
 Specialised signal that emits without passing data.
 
class  SignedByteContainerConcept
 Defines validating functionality for the signed byte container concept.
 
class  SigSlot
 Not for direct use, provides the power behind both signals and slots.
 
class  SigSlot< Void >
 Not for direct use, provides the power behind both void signals and slots.
 
class  SigSlotsManager
 The sigslots connection manager.
 
class  Singleton
 Singleton construction via the curiously recurring template pattern.
 
class  Slot
 Function loading component of a callback system.
 
class  Slot< Void >
 Specialised slot that handles void callbacks.
 
class  SmoothLinearSpline
 Storage container for a smoothed linear spline interpolation.
 
class  SpecificationException
 Defines the exception that is thrown whenever a conflict in arguments occurs.
 
class  SplineFunction
 Template wrapper for a generic spline function.
 
class  StandardException
 Standard exception type, provides code location and error string.
 
class  StdOutput
 TClap class indirectly used to handle CmdLine arguments.
 
class  Stencil
 A safe windowing class that opens onto array-like containers.
 
class  Stencil< const unsigned char * >
 Stencil variant operating on a raw const unsigned char array.
 
class  Stencil< unsigned char * >
 Stencil variant operating on a raw unsigned char array.
 
class  StreamConcept
 Defines validating functionality for the streams concept.
 
class  String
 A virtual device for manipulating strings.
 
class  StringStream
 Convenience wrapper for string device based textstreams. More...
 
class  SwitchArg
 
class  TensionFunction
 Representation of a tension function.
 
class  TensionSpline
 Storage container for a tension spline interpolation.
 
class  TextStream
 A text streaming interface. More...
 
class  TimeData
 Device for conveniently storing and analysing benchmarking times.
 
class  TimeError
 Extends the generic ecl error handler with some time specific error strings.
 
class  TimeStampBase
 This class provides common functionality across platforms for the timestamps.
 
class  Topic
 Stores publisher and subscriber lists to a uniquely string identified topic.
 
class  UnaryFreeFunction
 Unary function object for global/static functions.
 
class  UnaryFreeFunction< A, void >
 Specialisations for free unary functions with no return type.
 
class  UnaryFunction
 Virtual interface definition for unary function objects.
 
class  UnaryFunctionCopy
 Create a UnaryFunction object composited from an existing function object.
 
class  UnaryFunctionCopy< FunctionObject, T, void >
 Specialisation of UnaryFunctionCopy for void return types.
 
class  UnaryFunctionReference
 Creates a unary function from a reference wrapper.
 
class  UnaryFunctionReference< ReferenceWrapper, T, void >
 Creates a void unary function from a reference wrapper.
 
class  UnaryMemberFunction
 Binary function object for unary member functions.
 
class  UnaryMemberFunction< C, A, void >
 Specialisation of the binary function object for void unary member functions.
 
class  UnlabeledMultiArg
 
class  UnlabeledValueArg
 
struct  Unsigned
 Primary template for signed to unsigned type metafunctions.
 
struct  Unsigned< char >
 Metafunction for char to unsigned char type conversions.
 
struct  Unsigned< int >
 Metafunction for int to unsigned int type conversions.
 
struct  Unsigned< long >
 Metafunction for long to unsigned long type conversions.
 
struct  Unsigned< long long >
 Metafunction for long long to unsigned long long type conversions.
 
struct  Unsigned< short >
 Metafunction for short to unsigned short type conversions.
 
struct  Unsigned< unsigned char >
 Metafunction returning same type for unsigned chars.
 
struct  Unsigned< unsigned int >
 Metafunction returning same type for unsigned ints.
 
struct  Unsigned< unsigned long >
 Metafunction returning same type for unsigned longs.
 
struct  Unsigned< unsigned long long >
 Metafunction returning same type for unsigned long longs.
 
struct  Unsigned< unsigned short >
 Metafunction returning same type for unsigned shorts.
 
class  UnsignedByteContainerConcept
 Defines validating functionality for the byte container concept.
 
class  ValueArg
 
class  ValuesConstraint
 
class  VersionVisitor
 TClap class indirectly used to define the interface for visitors.
 
class  Visitor
 TClap class indirectly used to define the interface for visitors.
 
class  Void
 A void (null) object.
 
class  XorHandler
 TClap class indirectly used by CmdLine for handling xor'd arguments.
 

Typedefs

typedef std::list< Arg * >::iterator ArgListIterator
 
typedef std::list< Arg * >::iterator ArgListIterator
 
typedef std::vector< Arg * >::iterator ArgVectorIterator
 
typedef std::vector< Arg * >::iterator ArgVectorIterator
 
typedef CartesianPoint< double, 2 > CartesianPoint2d
 
typedef CartesianPoint< double, 2 > CartesianPoint2d
 
typedef CartesianPoint< double, 2 > CartesianPoint2d
 Eigen style convenience handle for x, y, z triples in double format. More...
 
typedef CartesianPoint< float, 2 > CartesianPoint2f
 
typedef CartesianPoint< float, 2 > CartesianPoint2f
 
typedef CartesianPoint< float, 2 > CartesianPoint2f
 Eigen style convenience handle for x, y, z triples in float format. More...
 
typedef CartesianPoint< int, 2 > CartesianPoint2i
 
typedef CartesianPoint< int, 2 > CartesianPoint2i
 
typedef CartesianPoint< int, 2 > CartesianPoint2i
 Eigen style convenience handle for x, y, z triples in integer format. More...
 
typedef CartesianPoint< double, 3 > CartesianPoint3d
 
typedef CartesianPoint< double, 3 > CartesianPoint3d
 
typedef CartesianPoint< double, 3 > CartesianPoint3d
 Eigen style convenience handle for x, y, z triples in double format. More...
 
typedef CartesianPoint< float, 3 > CartesianPoint3f
 
typedef CartesianPoint< float, 3 > CartesianPoint3f
 
typedef CartesianPoint< float, 3 > CartesianPoint3f
 Eigen style convenience handle for x, y, z triples in float format. More...
 
typedef CartesianPoint< int, 3 > CartesianPoint3i
 
typedef CartesianPoint< int, 3 > CartesianPoint3i
 
typedef CartesianPoint< int, 3 > CartesianPoint3i
 Eigen style convenience handle for x, y, z triples in integer format. More...
 
typedef Polynomial< 3 > CubicPolynomial
 
typedef Polynomial< 3 > CubicPolynomial
 
typedef Polynomial< 3 > CubicPolynomial
 Mathematical term for 3rd order polynomials. More...
 
typedef TimeStamp Duration
 
typedef TimeStamp Duration
 
typedef TimeStamp Duration
 
typedef TimeStamp Duration
 
typedef TimeStamp Duration
 
typedef TimeStamp Duration
 
typedef TimeStamp Duration
 Convenience typedef to associate timestamps with the concept of durations. More...
 
typedef TextStream< EConsoleEConsoleStream
 Streams to standard error. More...
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 
typedef Bool< false > False
 Convenient typedef for the 'false' integral constant wrapper. More...
 
typedef HomogeneousPoint< double > HomogeneousPointd
 
typedef HomogeneousPoint< double > HomogeneousPointd
 
typedef HomogeneousPoint< double > HomogeneousPointd
 Eigen style convenience handle for homogeneous points in double format. More...
 
typedef HomogeneousPoint< float > HomogeneousPointf
 
typedef HomogeneousPoint< float > HomogeneousPointf
 
typedef HomogeneousPoint< float > HomogeneousPointf
 Eigen style convenience handle for homogeneous points in float format. More...
 
typedef TextStream< IConsoleIConsoleStream
 Streams to standard input. More...
 
typedef Polynomial< 1 > LinearFunction
 
typedef Polynomial< 1 > LinearFunction
 
typedef Polynomial< 1 > LinearFunction
 Mathematical term for 1st order polynomials. More...
 
typedef TextStream< OConsoleOConsoleStream
 Streams to standard output. More...
 
typedef Polynomial< 2 > QuadraticPolynomial
 
typedef Polynomial< 2 > QuadraticPolynomial
 
typedef Polynomial< 2 > QuadraticPolynomial
 Mathematical term for 2nd order polynomials. More...
 
typedef Polynomial< 5 > QuinticPolynomial
 
typedef Polynomial< 5 > QuinticPolynomial
 
typedef Polynomial< 5 > QuinticPolynomial
 Mathematical term for 5th order polynomials. More...
 
typedef Eigen::Vector3f SimplePose2D
 2D float representation of planner poses (x, y, heading). More...
 
typedef Sophus::SE3f SimplePose3D
 3D float representation of planner poses. More...
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 
typedef Bool< true > True
 Convenient typedef for the 'true' integral constant wrapper. More...
 
typedef std::list< Visitor * >::iterator VisitorListIterator
 
typedef std::list< Visitor * >::iterator VisitorListIterator
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 
typedef void(* VoidFunction) ()
 Convenient type definition for empty functions (void pointers). More...
 

Enumerations

enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 
enum  Alignment { NoAlign, LeftAlign, RightAlign, CentreAlign }
 Alignment tags for text formatting. More...
 
enum  BaudRate {
  BaudRate_110, BaudRate_300, BaudRate_600, BaudRate_1200,
  BaudRate_2400, BaudRate_4800, BaudRate_9600, BaudRate_19200,
  BaudRate_38400, BaudRate_57600, BaudRate_115200, BaudRate_230400,
  BaudRate_460800, BaudRate_921600
}
 
enum  BaudRate {
  BaudRate_110, BaudRate_300, BaudRate_600, BaudRate_1200,
  BaudRate_2400, BaudRate_4800, BaudRate_9600, BaudRate_19200,
  BaudRate_38400, BaudRate_57600, BaudRate_115200, BaudRate_230400,
  BaudRate_460800, BaudRate_921600
}
 Serial connection baud rate. More...
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  Bits {
  Bit0 = 0x0000, Bit1 = 0x0001, Bit2 = 0x0002, Bit3 = 0x0004,
  Bit4 = 0x0008, Bit5 = 0x0010, Bit6 = 0x0020, Bit7 = 0x0040,
  Bit8 = 0x0080, Bit9 = 0x0100, Bit10 = 0x0200, Bit11 = 0x0400,
  Bit12 = 0x0800, Bit13 = 0x1000, Bit14 = 0x2000, Bit15 = 0x4000,
  Bit16 = 0x8000
}
 
enum  ConnectionStatus { ConnectionProblem = -1, ConnectionDisconnected = -2, ConnectionHungUp = -3 }
 
enum  ConnectionStatus { ConnectionProblem = -1, ConnectionDisconnected = -2, ConnectionHungUp = -3 }
 Used to denote the status of a connection. More...
 
enum  DataBits { DataBits_5 = 0, DataBits_6, DataBits_7, DataBits_8 }
 
enum  DataBits { DataBits_5 = 0, DataBits_6, DataBits_7, DataBits_8 }
 Data bits used in a serial packet. More...
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 
enum  ErrorFlag {
  NoError = 0, UnknownError = -1, OutOfRangeError = -2, ConstructorError = -3,
  DestructorError = -4, ConversionError = -5, OpenError = -6, CloseError = -7,
  InvalidArgError = -8, ConfigurationError = -9, ConnectionError = -10, ReadError = -11,
  WriteError = -12, NotInitialisedError = -13, PermissionsError = -14, MemoryError = -15,
  UsageError = -16, RaiiError = -17, ArgNotSupportedError = -18, NotSupportedError = -19,
  BusyError = -20, OutOfResourcesError = -21, InterruptedError = -22, BlockingError = -23,
  SystemFailureError = -24, InvalidObjectError = -25, IsLockedError = -26, TimeOutError = -27,
  NotFoundError = -28, ConnectionRefusedError = -29, PosixError = -101, InvalidInputError = -103
}
 Enumerated flags for error message handling. More...
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 
enum  FloatBase { Fixed, Sci }
 Base format tags for the float formatters. More...
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 
enum  IntegralBase { Bin, Hex, Dec }
 Base format tags for the integral formatters. More...
 
enum  Parity { NoParity = 0, OddParity = 1, EvenParity = 2 }
 
enum  Parity { NoParity = 0, OddParity = 1, EvenParity = 2 }
 Parity of the serial packet. More...
 
enum  Pose2DStorageType { RotationAngleStorage, RotationMatrixStorage }
 
enum  Pose2DStorageType { RotationAngleStorage, RotationMatrixStorage }
 
enum  Pose2DStorageType { RotationAngleStorage, RotationMatrixStorage }
 Used by the traits to select the storage type for Pose2D classes. More...
 
enum  Priority {
  DefaultPriority = 0, UnknownPriority, BackgroundPriority, LowPriority,
  NormalPriority, HighPriority, CriticalPriority, RealTimePriority1,
  RealTimePriority2, RealTimePriority3, RealTimePriority4
}
 
enum  Priority {
  DefaultPriority = 0, UnknownPriority, BackgroundPriority, LowPriority,
  NormalPriority, HighPriority, CriticalPriority, RealTimePriority1,
  RealTimePriority2, RealTimePriority3, RealTimePriority4
}
 
enum  Priority {
  DefaultPriority = 0, UnknownPriority, BackgroundPriority, LowPriority,
  NormalPriority, HighPriority, CriticalPriority, RealTimePriority1,
  RealTimePriority2, RealTimePriority3, RealTimePriority4
}
 
enum  Priority {
  DefaultPriority = 0, UnknownPriority, BackgroundPriority, LowPriority,
  NormalPriority, HighPriority, CriticalPriority, RealTimePriority1,
  RealTimePriority2, RealTimePriority3, RealTimePriority4
}
 Shared abstraction of the scheduling priorities. More...
 
enum  StopBits { StopBits_1 = 0, StopBits_15, StopBits_2 }
 
enum  StopBits { StopBits_1 = 0, StopBits_15, StopBits_2 }
 Stop bits used in a serial packet. More...
 
enum  StorageType { DynamicStorage = 0, FixedStorage = 1 }
 
enum  StorageType { DynamicStorage = 0, FixedStorage = 1 }
 
enum  StorageType { DynamicStorage = 0, FixedStorage = 1 }
 
enum  StorageType { DynamicStorage = 0, FixedStorage = 1 }
 
enum  StorageType { DynamicStorage = 0, FixedStorage = 1 }
 
enum  StorageType { DynamicStorage = 0, FixedStorage = 1 }
 A simple flag for denoting the storage type of the container. More...
 
enum  WriteMode { New, Append }
 
enum  WriteMode { New, Append }
 Write mode for devices. More...
 

Functions

T * addressOf (T &v)
 Returns the address of an object (uses correct c++ syntactics). More...
 
ReferenceWrapper< T const > cref (T const &wrapped_object)
 
Scalar cube_root (const Scalar &x)
 The real solution to a cube root. More...
 
ecl_geometry_PUBLICdegrees_to_radians (const T &degrees, typename enable_if< ecl::is_float< T > >::type *dummy=0)
 Converts degrees to radians and returns the result. More...
 
euclidean_norm (const T &x1, const T &x2)
 Function for euclidean norms of dimension 2. More...
 
euclidean_norm (const T &x1, const T &x2, const T &x3)
 Function for euclidean norms of dimension 3. More...
 
BoundNullaryMemberFunction< C, R > generateFunctionObject (R(C::*function)(), C &c)
 Generate a nullary function object by binding a nullary member function with its instance. More...
 
BoundUnaryMemberFunction< C, A, R > generateFunctionObject (R(C::*function)(A), C &c, const I &a)
 Generate a nullary function object by binding a unary member function. More...
 
BoundUnaryMemberFunction< C, A, R > generateFunctionObject (R(C::*function)(A), C &c, I &a)
 Generate a nullary function object by binding a unary member function. More...
 
PartiallyBoundUnaryMemberFunction< C, A, R > generateFunctionObject (R(C::*function)(A), C &c)
 Generate a unary function object by partially binding a unary member function. More...
 
BoundUnaryFreeFunction< A, R > generateFunctionObject (R(*function)(A), I &a)
 Generate a nullary function object from a bound unary global/static function. More...
 
BoundUnaryFreeFunction< A, R > generateFunctionObject (R(*function)(A), const I &a)
 Generate a nullary function object from a bound unary global/static function. More...
 
NullaryFreeFunction< R > generateFunctionObject (R(*function)())
 Generate a nullary function object from a void global/static function. More...
 
UnaryMemberFunction< C, A, R > generateFunctionObject (R(C::*function)(A))
 Generate a binary function object from a unary member function. More...
 
NullaryMemberFunction< C, R > generateFunctionObject (R(C::*function)())
 Generate a unary function object from a nullary member function. More...
 
UnaryFreeFunction< A, R > generateFunctionObject (R(*function)(A))
 Generate a unary function object from a unary global/static function. More...
 
bool is_big_endian ()
 Determines if your platform is big endian (at compile time). More...
 
bool is_char_signed ()
 Determines if your platform char type is signed or otherwise. More...
 
bool isApprox (const Scalar &x, const OtherScalar &y, typename numeric_limits< Scalar >::Precision precision=numeric_limits< Scalar >::dummy_precision)
 Checks if two values are approximate. More...
 
bool isApproxOrLessThan (const Scalar &x, const OtherScalar &y, typename numeric_limits< Scalar >::Precision precision=numeric_limits< Scalar >::dummy_precision)
 Checks if the first value is less than or approximate to the second. More...
 
int nsign (const Scalar &x)
 A sign function for numerical values (negative return if arg is zero). More...
 
OutputStream & operator<< (OutputStream &ostream, const TensionSpline &tension_spline)
 
OutputStream & operator<< (OutputStream &ostream, const HomogeneousPoint< Type > &point)
 
OutputStream & operator<< (OutputStream &ostream, const SmoothLinearSpline &smooth_linear_spline)
 
OutputStream & operator<< (OutputStream &ostream, const CartesianPoint< Type, 3 > &point)
 
OutputStream & operator<< (OutputStream &ostream, Format< std::string > &formatter) ecl_assert_throw_decl(StandardException)
 
OutputStream & operator<< (OutputStream &ostream, const TensionFunction &function)
 Streaming output insertion operator for tension functions. More...
 
OutputStream & operator<< (OutputStream &ostream, const CubicSpline &cubic_spline)
 
OutputStream & operator<< (OutputStream &ostream, const Array< ElementType, ArraySize > &array)
 
OutputStream & operator<< (OutputStream &ostream, const Topic< TopicData > &topic)
 
OutputStream & operator<< (OutputStream &ostream, const Stencil< ArrayType > &stencil)
 
OutputStream & operator<< (OutputStream &ostream, const TimeStampBase &time_stamp)
 
OutputStream & operator<< (OutputStream &ostream, const Array< ElementType, DynamicStorage > &array)
 
OutputStream & operator<< (OutputStream &ostream, const LegacyPose2D< Float_, Storage_ > &pose)
 
OutputStream & operator<< (OutputStream &ostream, const CartesianPoint< Type, 2 > &point)
 
OutputStream & operator<< (OutputStream &ostream, const PascalsTriangle< PowerN > &triangle)
 Streaming output insertion operator for for pascal triangles. More...
 
OutputStream & operator<< (OutputStream &ostream, const PascalsTriangle< 3 > &triangle)
 Insertion operator for streaming output from pascal's triangle of degree 3. More...
 
OutputStream & operator<< (OutputStream &ostream, const Void void_object)
 Output stream operator for Void objects. More...
 
OutputStream & operator<< (OutputStream &ostream, const Polynomial< Degree > &polynomial)
 
OutputStream & operator<< (OutputStream &ostream, const LegacyPose3D< Float_ > &pose)
 
OutputStream & operator<< (OutputStream &ostream, const PascalsTriangle< 5 > &triangle)
 Insertion operator for streaming output from pascal's triangle of degree 5. More...
 
template<typename OutputStream , typename Float_ >
OutputStream & operator<< (OutputStream &ostream, const Pose3D< Float_ > &pose)
 Insertion operator for output streams. More...
 
template<typename OutputStream , typename Float_ , enum Pose2DStorageType Storage_>
OutputStream & operator<< (OutputStream &ostream, const Pose2D< Float_, Storage_ > &pose)
 Insertion operator for output streams. More...
 
int psign (const Scalar &x)
 A sign function for numerical values (positive return if arg is zero). More...
 
ecl_geometry_PUBLICradians_to_degrees (const T &radians, typename enable_if< ecl::is_float< T > >::type *dummy=0)
 Converts radians to degrees and returns the result. More...
 
ReferenceWrapper< T > ref (T &wrapped_object)
 
int sign (const Scalar &x)
 A sign function for numerical values. More...
 
ecl_geometry_PUBLIC const double & wrap_angle (double &angle)
 Wrap the angle on -pi,pi (double types). More...
 
ecl_geometry_PUBLIC const float & wrap_angle (float &angle)
 Wrap the angle on -pi,pi (float types). More...
 
ecl_geometry_PUBLIC float wrap_angle (const float &angle)
 Return the wrapped the angle on -pi,pi (float types). More...
 
ecl_geometry_PUBLIC double wrap_angle (const double &angle)
 Return the wrapped the angle on -pi,pi (double types). More...
 

Variables

 Append
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 ArgNotSupportedError
 
 BackgroundPriority
 
 BackgroundPriority
 
 BackgroundPriority
 
 BaudRate_110
 
 BaudRate_115200
 
 BaudRate_1200
 
 BaudRate_19200
 
 BaudRate_230400
 
 BaudRate_2400
 
 BaudRate_300
 
 BaudRate_38400
 
 BaudRate_460800
 
 BaudRate_4800
 
 BaudRate_57600
 
 BaudRate_600
 
 BaudRate_921600
 
 BaudRate_9600
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bin
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit0
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit1
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit10
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit11
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit12
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit13
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit14
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit15
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit16
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit2
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit3
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit4
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit5
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit6
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit7
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit8
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 Bit9
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BlockingError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 BusyError
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CentreAlign
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
 CloseError
 
ClearScreen clrscr
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConfigurationError
 
 ConnectionDisconnected
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionError
 
 ConnectionHungUp
 
 ConnectionProblem
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConnectionRefusedError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConstructorError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 ConversionError
 
 CriticalPriority
 
 CriticalPriority
 
 CriticalPriority
 
 DataBits_5
 
 DataBits_6
 
 DataBits_7
 
 DataBits_8
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 Dec
 
 DefaultPriority
 
 DefaultPriority
 
 DefaultPriority
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DestructorError
 
 DynamicStorage
 
 DynamicStorage
 
 DynamicStorage
 
 DynamicStorage
 
 DynamicStorage
 
EndOfLine endl
 
 EvenParity
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 Fixed
 
 FixedStorage
 
 FixedStorage
 
 FixedStorage
 
 FixedStorage
 
 FixedStorage
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 Hex
 
 HighPriority
 
 HighPriority
 
 HighPriority
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InterruptedError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidArgError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidInputError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 InvalidObjectError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 IsLockedError
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LeftAlign
 
 LowPriority
 
 LowPriority
 
 LowPriority
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 MemoryError
 
 New
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoAlign
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoError
 
 NoParity
 
 NormalPriority
 
 NormalPriority
 
 NormalPriority
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotFoundError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotInitialisedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 NotSupportedError
 
 OddParity
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OpenError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfRangeError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 OutOfResourcesError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
 PermissionsError
 
double const pi
 
double const pi
 
double const pi
 
double const pi
 
double const pi
 
double const pi
 
double const pi
 
double const pi
 
double const pi = 4.0*std::atan(1.0)
 Mathematical constant for pi. More...
 
const double pi_2
 
const double pi_2
 
const double pi_2
 
const double pi_2
 
const double pi_2
 
const double pi_2
 
const double pi_2
 
const double pi_2
 
const double pi_2 = pi/2.0
 Mathematical constant for pi/2. More...
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f
 
const float pi_2_f = pi_2
 Mathematical constant (float format) for pi/2. More...
 
const double pi_4
 
const double pi_4
 
const double pi_4
 
const double pi_4
 
const double pi_4
 
const double pi_4
 
const double pi_4
 
const double pi_4
 
const double pi_4 = pi/4.0
 Mathematical constant for pi/4. More...
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f
 
const float pi_4_f = pi_4
 Mathematical constant (float format) for pi/4. More...
 
const float pi_f
 
const float pi_f
 
const float pi_f
 
const float pi_f
 
const float pi_f
 
const float pi_f
 
const float pi_f
 
const float pi_f
 
const float pi_f = pi
 Mathematical constant (float format) for pi. More...
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 PosixError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 RaiiError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 ReadError
 
 RealTimePriority1
 
 RealTimePriority1
 
 RealTimePriority1
 
 RealTimePriority2
 
 RealTimePriority2
 
 RealTimePriority2
 
 RealTimePriority3
 
 RealTimePriority3
 
 RealTimePriority3
 
 RealTimePriority4
 
 RealTimePriority4
 
 RealTimePriority4
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RightAlign
 
 RotationAngleStorage
 
 RotationAngleStorage
 
 RotationMatrixStorage
 
 RotationMatrixStorage
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 Sci
 
 StopBits_1
 
 StopBits_15
 
 StopBits_2
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 SystemFailureError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
 TimeOutError
 
const double two_pi
 
const double two_pi
 
const double two_pi
 
const double two_pi
 
const double two_pi
 
const double two_pi
 
const double two_pi
 
const double two_pi
 
const double two_pi = 2.0*pi
 Mathematical constant for 2*pi. More...
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f
 
const float two_pi_f = two_pi
 Mathematical constant (float format) for 2*pi. More...
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownError
 
 UnknownPriority
 
 UnknownPriority
 
 UnknownPriority
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 UsageError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 
 WriteError
 

Typedef Documentation

typedef std::list<Arg*>::iterator ecl::ArgListIterator

Typedef of an Arg list iterator.

Definition at line 336 of file arg.hpp.

typedef std::vector<Arg*>::iterator ecl::ArgVectorIterator

Typedef of an Arg vector iterator.

Definition at line 341 of file arg.hpp.

Eigen style convenience handle for x, y, z triples in double format.

Definition at line 499 of file cartesian_point.hpp.

Eigen style convenience handle for x, y, z triples in float format.

Definition at line 500 of file cartesian_point.hpp.

Eigen style convenience handle for x, y, z triples in integer format.

Definition at line 501 of file cartesian_point.hpp.

Eigen style convenience handle for x, y, z triples in double format.

Definition at line 264 of file cartesian_point.hpp.

Eigen style convenience handle for x, y, z triples in float format.

Definition at line 265 of file cartesian_point.hpp.

Eigen style convenience handle for x, y, z triples in integer format.

Definition at line 266 of file cartesian_point.hpp.

Mathematical term for 3rd order polynomials.

Definition at line 389 of file polynomial.hpp.

typedef TimeStamp ecl::Duration

Convenience typedef to associate timestamps with the concept of durations.

Both timestamps and durations utilise similar functionality under the hood, even though they are conceptually different. The only thing I might consider if creating a separate class for durations is to introduce negativity. However, I've yet to find a real use for it.

Definition at line 41 of file duration.hpp.

Streams to standard error.

Streams to standard error.

Usage:

There is no need to open this device, it automatically connects to stderr.

1 EConsoleStream estream;
2 estream << "Boom";
3 estream.flush();

Definition at line 90 of file console_streams.hpp.

typedef Bool<false> ecl::False

Convenient typedef for the 'false' integral constant wrapper.

Definition at line 41 of file bool.hpp.

Eigen style convenience handle for homogeneous points in double format.

Definition at line 188 of file homogeneous_point.hpp.

Eigen style convenience handle for homogeneous points in float format.

Definition at line 187 of file homogeneous_point.hpp.

Streams to standard input.

Streams to standard input.

Usage:

There is no need to open this device, it automatically connects to stdin.

1 IConsoleStream istream;
2 string str;
3 istream << str;

Definition at line 74 of file console_streams.hpp.

Mathematical term for 1st order polynomials.

Definition at line 387 of file polynomial.hpp.

Streams to standard output.

This class operates similar to, but posesses several advantages to the usual cout c++ mechanism.

  • Faster.
  • Can be instantiated separately, each with its own internal buffer.

The ecl could provide a global mechanism very much like the cout handle, but instantiating separately stops getting standard output messages confused and is a useful property for multi-threaded control applications. If you wish to use a global mechanism, simply instantiate a global instance in your program.

Usage:

There is no need to open this device, it automatically connects to stdout.

1 OConsoleStream ostream;
2 ostream << "Hey dude";
3 ostream.flush();
See also
TextStream.

Definition at line 58 of file console_streams.hpp.

Mathematical term for 2nd order polynomials.

Definition at line 388 of file polynomial.hpp.

Mathematical term for 5th order polynomials.

Definition at line 390 of file polynomial.hpp.

typedef Eigen::Vector3f ecl::SimplePose2D

2D float representation of planner poses (x, y, heading).

Definition at line 32 of file pose.hpp.

typedef Sophus::SE3f ecl::SimplePose3D

3D float representation of planner poses.

Definition at line 33 of file pose.hpp.

typedef Bool<true> ecl::True

Convenient typedef for the 'true' integral constant wrapper.

Definition at line 42 of file bool.hpp.

typedef std::list<Visitor*>::iterator ecl::VisitorListIterator

Typedef of a Visitor list iterator.

Definition at line 346 of file arg.hpp.

typedef void(* ecl::VoidFunction) ()

Convenient type definition for empty functions (void pointers).

Convenient type definition for empty functions (void pointers). Wherever you would normally use

1 void(*)()

you can instead replace with the more convenient

1 VoidFunction

Definition at line 44 of file void.hpp.

Enumeration Type Documentation

Alignment tags for text formatting.

Common alignment format tag for the formatters.

Enumerator
NoAlign 

No alignment used.

LeftAlign 

Align to the left.

RightAlign 

Align to the right.

CentreAlign 

Align in the centre.

Definition at line 29 of file common.hpp.

Serial connection baud rate.

The baud rate of a serial connection. Support is rather dependent on the device, so check first. Some good references:

Enumerator
BaudRate_110 
BaudRate_300 
BaudRate_600 
BaudRate_1200 
BaudRate_2400 
BaudRate_4800 
BaudRate_9600 
BaudRate_19200 
BaudRate_38400 
BaudRate_57600 
BaudRate_115200 
BaudRate_230400 
BaudRate_460800 
BaudRate_921600 

Definition at line 34 of file serial_parameters.hpp.

enum ecl::Bits
Enumerator
Bit0 
Bit1 
Bit2 
Bit3 
Bit4 
Bit5 
Bit6 
Bit7 
Bit8 
Bit9 
Bit10 
Bit11 
Bit12 
Bit13 
Bit14 
Bit15 
Bit16 

Definition at line 28 of file utilities/flags.hpp.

Used to denote the status of a connection.

Enumerator
ConnectionProblem 

Was some error in the last operation..

ConnectionDisconnected 

Used to state when a server/client detects that there is no other connection at the other end.

ConnectionHungUp 

Used to signify when a server/client detects that the other end has 'hung up'.

Definition at line 32 of file socket_connection_status.hpp.

Data bits used in a serial packet.

The number of data bits used in the serial protocol.

Enumerator
DataBits_5 
DataBits_6 
DataBits_7 
DataBits_8 

Definition at line 56 of file serial_parameters.hpp.

Enumerated flags for error message handling.

These are simple flags to identify the type of error when it occurs. Use with the Error class (and its child classes, e.g. TimeError) to identify errors and get verbose string output when debugging.

Enumerator
NoError 

No error (often a meaningful error state in itself).

UnknownError 

Unknown error type.

OutOfRangeError 

Tried to access beyond the range of the object (usually container).

ConstructorError 

An error occurred somewhere inside a class constructor.

DestructorError 

The destructor failed to self-destruct.

ConversionError 

A conversion (usually between types) failed.

OpenError 

Failed to open an input/output device.

CloseError 

Failed to close an input/output device.

InvalidArgError 

The user entered an invalid argument to this method, c.f. InvalidObjectError.

ConfigurationError 

There was a configuration error (usually in a configure() or initialise() method).

ConnectionError 

There was a connection error, usually with input-output devices.

ReadError 

There was a read error, usually with input-output devices.

WriteError 

There was a write error, usually with input-output devices.

NotInitialisedError 

The target object has not yet been initialised, accessing before doing so is not permitted.

PermissionsError 

The caller does not have the required permissions.

MemoryError 

There was a problem allocating the requested memory.

UsageError 

The object was used incorrectly and caused an error.

RaiiError 

The object is pure RAII style and must be initialised properly.

ArgNotSupportedError 

The combination of input arguments is not supported on this platform.

NotSupportedError 

This operation is not supported on this platform.

BusyError 

Resources are busy, operation is not permitted.

OutOfResourcesError 

Out of resources, cannot proceed.

InterruptedError 

This operation was interrupted.

BlockingError 

A device marked as blocking, but used as non-blocking, or vice versa.

SystemFailureError 

A subcomponent of the system platform has failed (e.g. io subsystem).

InvalidObjectError 

Attempted to work on an invalid object (e.g. dir instead of a file), c.f. InvalidArgError

IsLockedError 

Invalidates attempts to work further because an object is locked.

TimeOutError 

A timeout occured.

NotFoundError 

An object was not found.

ConnectionRefusedError 

A connection was refused by the other end (e.g. socket client server connections).

PosixError 

Deprecating.

InvalidInputError 

Deprecated.

Definition at line 36 of file errors/flags.hpp.

Base format tags for the float formatters.

Base format tags for text formatting of floats.

Enumerator
Fixed 

Fixed formatting for floats (i.e. normal decimal representation).

Sci 

Scientific formatting for floats (i.e. exponential representation).

Definition at line 42 of file floats.hpp.

Base format tags for the integral formatters.

Format tags for text formatting of integral numbers.

Enumerator
Bin 

Binary representation for integral types.

Hex 

Hex representation for integral types.

Dec 

Decimal (i.e. normal) representation for integral types.

Definition at line 37 of file number.hpp.

Parity of the serial packet.

Parity of the serial communication.

Enumerator
NoParity 
OddParity 
EvenParity 

Definition at line 79 of file serial_parameters.hpp.

Used by the traits to select the storage type for Pose2D classes.

Enumerator
RotationAngleStorage 

RotationAngleStorage.

RotationMatrixStorage 

RotationMatrixStorage.

Definition at line 44 of file pose2d.hpp.

Shared abstraction of the scheduling priorities.

Defines a priority level for priority scheduling of a thread/process. They are effectively ranked as indicated, however their implementation will be different for different systems.

Enumerator
DefaultPriority 
UnknownPriority 
BackgroundPriority 
LowPriority 
NormalPriority 
HighPriority 
CriticalPriority 
RealTimePriority1 
RealTimePriority2 
RealTimePriority3 
RealTimePriority4 

Definition at line 32 of file priority_common.hpp.

Stop bits used in a serial packet.

Number of stop bits used in the serial protocol.

Enumerator
StopBits_1 
StopBits_15 
StopBits_2 

Definition at line 68 of file serial_parameters.hpp.

A simple flag for denoting the storage type of the container.

This simply denotes whether the container is dynamic or fixed memory. Currently it is only used under the hood on the Array container. Users should not need to use this directly.

Enumerator
DynamicStorage 

Dynamic

FixedStorage 

Fixed

Definition at line 31 of file definitions.hpp.

Write mode for devices.

Defines the write modes for writing to an output device. Primarily used for files.

Enumerator
New 

Opens a new object (deletes existing objects).

Append 

Appends to an existing object (opens if not existing).

Definition at line 35 of file modes.hpp.

Function Documentation

template<typename OutputStream , typename Float_ >
OutputStream& ecl::operator<< ( OutputStream &  ostream,
const Pose3D< Float_ > &  pose 
)

Insertion operator for output streams.

Note that the output heading angle is formatted in degrees.

Parameters
ostream: stream satisfying the ecl stream concept.
pose: the inserted pose.
Returns
OutputStream : the returning stream handle.

Definition at line 308 of file pose3d.hpp.

template<typename OutputStream , typename Float_ , enum Pose2DStorageType Storage_>
OutputStream& ecl::operator<< ( OutputStream &  ostream,
const Pose2D< Float_, Storage_ > &  pose 
)

Insertion operator for output streams.

Note that the output heading angle is formatted in degrees.

Parameters
ostream: stream satisfying the ecl stream concept.
pose: the inserted pose.
Returns
OutputStream : the returning stream handle.

Definition at line 456 of file pose2d.hpp.

Variable Documentation

ClearScreen ecl::clrscr
EndOfLine ecl::endl
double const ecl::pi = 4.0*std::atan(1.0)

Mathematical constant for pi.

Definition at line 37 of file constants.hpp.

const double ecl::pi_2 = pi/2.0

Mathematical constant for pi/2.

Definition at line 39 of file constants.hpp.

const float ecl::pi_2_f = pi_2

Mathematical constant (float format) for pi/2.

Definition at line 43 of file constants.hpp.

const double ecl::pi_4 = pi/4.0

Mathematical constant for pi/4.

Definition at line 40 of file constants.hpp.

const float ecl::pi_4_f = pi_4

Mathematical constant (float format) for pi/4.

Definition at line 44 of file constants.hpp.

const float ecl::pi_f = pi

Mathematical constant (float format) for pi.

Definition at line 42 of file constants.hpp.

const double ecl::two_pi = 2.0*pi

Mathematical constant for 2*pi.

Definition at line 38 of file constants.hpp.

const float ecl::two_pi_f = two_pi

Mathematical constant (float format) for 2*pi.

Definition at line 41 of file constants.hpp.



xbot_driver
Author(s): Roc, wangpeng@droid.ac.cn
autogenerated on Sat Oct 10 2020 03:27:38