►Ncs | CameraServer (cscore) namespace |
CAxisCamera | A source that represents an Axis IP camera |
CCvSink | A sink for user code to accept video frames as OpenCV images |
CCvSource | A source for user code to provide OpenCV images as video frames |
CHttpCamera | A source that represents a MJPEG-over-HTTP (IP) camera |
CMjpegServer | A sink that acts as a MJPEG-over-HTTP network server |
CRawEvent | Listener event |
CUsbCamera | A source that represents a USB camera |
CUsbCameraInfo | USB camera information |
CVideoCamera | A source that represents a video camera |
CVideoEvent | An event generated by the library and provided to event listeners |
CVideoListener | An event listener |
CVideoMode | Video mode |
CVideoProperty | A source or sink property |
CVideoSink | A sink for video that accepts a sequence of frames |
CVideoSource | A source for video that provides a sequence of frames |
►Nfrc | WPILib FRC namespace |
►Nsim | |
CAccelerometerSim | |
CAnalogGyroSim | |
CAnalogInSim | |
CAnalogOutSim | |
CAnalogTriggerSim | |
CCallbackStore | |
CDigitalPWMSim | |
CDIOSim | |
CDriverStationSim | |
CEncoderSim | |
CPCMSim | |
CPDPSim | |
CPWMSim | |
CRelaySim | |
CRoboRioSim | |
CSPIAccelerometerSim | |
CAccelerometer | Interface for 3-axis accelerometers |
►CADXL345_I2C | ADXL345 Accelerometer on I2C |
CAllAxes | |
►CADXL345_SPI | ADXL345 Accelerometer on SPI |
CAllAxes | |
►CADXL362 | ADXL362 SPI Accelerometer |
CAllAxes | |
CADXRS450_Gyro | Use a rate gyro to return the robots heading relative to a starting position |
CAnalogAccelerometer | Handle operation of an analog accelerometer |
CAnalogGyro | Use a rate gyro to return the robots heading relative to a starting position |
CAnalogInput | Analog input class |
CAnalogOutput | MXP analog output class |
CAnalogPotentiometer | Class for reading analog potentiometers |
CAnalogTrigger | |
CAnalogTriggerOutput | Class to represent a specific output from an analog trigger |
CBuiltInAccelerometer | Built-in accelerometer |
CButton | This class provides an easy way to link commands to OI inputs |
CButtonScheduler | |
CCameraServer | Singleton class for creating and keeping camera servers |
CCameraServerShared | |
CCAN | High level class for interfacing with CAN devices conforming to the standard CAN spec |
CCancelButtonScheduler | |
CCANData | |
CCANStatus | |
Ccircular_buffer | This is a simple circular buffer so we don't need to "bucket brigade" copy old values |
CCommand | At the very core of the entire command framework |
CCommandGroup | A CommandGroup is a list of commands which are executed in sequence |
CCommandGroupEntry | |
CCompressor | Class for operating a compressor connected to a PCM (Pneumatic Control Module) |
CConditionalCommand | A ConditionalCommand is a Command that starts one of two commands |
CController | Interface for Controllers |
CControllerPower | |
CCounter | Class for counting the number of ticks on a digital input channel |
CCounterBase | Interface for counting the number of ticks on a digital input channel |
CDifferentialDrive | A class for driving differential drive/skid-steer drive platforms such as the Kit of Parts drive base, "tank drive", or West Coast Drive |
CDigitalGlitchFilter | Class to enable glitch filtering on a set of digital inputs |
CDigitalInput | Class to read a digital input |
CDigitalOutput | Class to write to digital outputs |
CDigitalSource | DigitalSource Interface |
CDMC60 | Digilent DMC 60 Speed Controller |
CDoubleSolenoid | DoubleSolenoid class for running 2 channels of high voltage Digital Output (PCM) |
CDriverStation | Provide access to the network communication data to / from the Driver Station |
CEncoder | Class to read quad encoders |
CError | Error object represents a library error |
CErrorBase | Base class for most objects |
CFilter | Interface for filters |
CGearTooth | Alias for counter class |
CGenericHID | GenericHID Interface |
CGyro | Interface for yaw rate gyros |
CGyroBase | GyroBase is the common base class for Gyro implementations such as AnalogGyro |
CHasBeenMoved | |
CHeldButtonScheduler | |
CI2C | I2C bus interface class |
CInstantCommand | This command will execute once, then finish immediately afterward |
CInternalButton | |
CInterruptableSensorBase | |
CIterativeRobot | IterativeRobot implements the IterativeRobotBase robot program framework |
CIterativeRobotBase | IterativeRobotBase implements a specific type of robot program framework, extending the RobotBase class |
CJaguar | Luminary Micro / Vex Robotics Jaguar Speed Controller with PWM control |
CJoystick | Handle input from standard Joysticks connected to the Driver Station |
CJoystickButton | |
CKilloughDrive | A class for driving Killough drive platforms |
CLinearDigitalFilter | This class implements a linear, digital filter |
CLiveWindow | Public interface for putting sensors and actuators on the LiveWindow |
CMecanumDrive | A class for driving Mecanum drive platforms |
CMotorSafety | |
CMotorSafetyHelper | |
CNetworkButton | |
CNidecBrushless | Nidec Brushless Motor |
CNotifier | |
CNullDeleter | |
CPIDBase | Class implements a PID Control Loop |
CPIDCommand | |
CPIDController | Class implements a PID Control Loop |
CPIDInterface | |
CPIDOutput | PIDOutput interface is a generic output for the PID class |
CPIDSource | PIDSource interface is a generic sensor source for the PID class |
CPIDSubsystem | This class is designed to handle the case where there is a Subsystem which uses a single PIDController almost constantly (for instance, an elevator which attempts to stay at a constant height) |
CPotentiometer | Interface for potentiometers |
CPowerDistributionPanel | Class for getting voltage, current, temperature, power and energy from the CAN PDP |
CPreferences | The preferences class provides a relatively simple way to save important values to the roboRIO to access the next time the roboRIO is booted |
CPressedButtonScheduler | |
CPrintCommand | |
CPWM | Class implements the PWM generation in the FPGA |
CPWMSpeedController | Common base class for all PWM Speed Controllers |
CPWMTalonSRX | Cross the Road Electronics (CTRE) Talon SRX Speed Controller with PWM control |
CPWMVictorSPX | Cross the Road Electronics (CTRE) Victor SPX Speed Controller with PWM control |
CRelay | Class for Spike style relay outputs |
CReleasedButtonScheduler | |
CResource | Convenient way to track allocated resources |
CRobotBase | Implement a Robot Program framework |
CRobotController | |
CRobotDrive | Utility class for handling Robot drive based on a definition of the motor configuration |
CRobotDriveBase | Common base class for drive platforms |
CRobotState | |
CSafePWM | A safe version of the PWM class |
CScheduler | |
CSD540 | Mindsensors SD540 Speed Controller |
CSendable | |
CSendableBase | |
CSendableBuilder | |
CSendableBuilderImpl | |
CSendableChooser | The SendableChooser class is a useful tool for presenting a selection of options to the SmartDashboard |
CSendableChooserBase | This class is a non-template base class for SendableChooser |
CSensorUtil | Stores most recent status information as well as containing utility functions for checking channels and error processing |
CSerialPort | Driver for the RS-232 serial port on the roboRIO |
CServo | Standard hobby style servo |
CSmartDashboard | |
CSolenoid | Solenoid class for running high voltage Digital Output (PCM) |
CSolenoidBase | SolenoidBase class is the common base class for the Solenoid and DoubleSolenoid classes |
CSpark | REV Robotics Speed Controller |
CSpeedController | Interface for speed controlling devices |
CSpeedControllerGroup | |
CSPI | SPI bus interface class |
CStartCommand | |
CSubsystem | |
CSynchronousPID | Class implements a synchronous PID control loop |
CTalon | Cross the Road Electronics (CTRE) Talon and Talon SR Speed Controller |
CTimedCommand | A TimedCommand will wait for a timeout before finishing |
CTimedRobot | TimedRobot implements the IterativeRobotBase robot program framework |
CTimer | Timer objects measure accumulated time in seconds |
CToggleButtonScheduler | |
CTrigger | This class provides an easy way to link commands to inputs |
CUltrasonic | Ultrasonic rangefinder class |
CVector2d | This is a 2D vector struct that supports basic vector operations |
CVictor | Vex Robotics Victor 888 Speed Controller |
CVictorSP | Vex Robotics Victor SP Speed Controller |
CVisionPipeline | A vision pipeline is responsible for running a group of OpenCV algorithms to extract data from an image |
CVisionRunner | A vision runner is a convenient wrapper object to make it easy to run vision pipelines from robot code |
CVisionRunnerBase | Non-template base class for VisionRunner |
CWaitCommand | |
CWaitForChildren | |
CWaitUntilCommand | |
CWatchdog | A class that's a wrapper around a watchdog timer |
CXboxController | Handle input from Xbox 360 or Xbox One controllers connected to the Driver Station |
►Nhal | WPILib Hardware Abstraction Layer (HAL) namespace |
CDigitalHandleResource | The DigitalHandleResource class is a way to track handles |
CDIOSetProxy | Proxy class for directly manipulating the DIO pins |
Cfpga_clock | A std::chrono compatible wrapper around the FPGA Timer |
CHalCallbackListener | |
CHalCallbackListenerVectorImpl | |
CHandleBase | Base for all HAL Handles |
CIndexedClassedHandleResource | The IndexedClassedHandleResource class is a way to track handles |
CIndexedHandleResource | The IndexedHandleResource class is a way to track handles |
CLimitedClassedHandleResource | The LimitedClassedHandleResource class is a way to track handles |
CLimitedHandleResource | The LimitedHandleResource class is a way to track handles |
CSerialHelper | A class for deterministically getting information about Serial Ports |
CUnlimitedHandleResource | The UnlimitedHandleResource class is a way to track handles |
►Nnt | NetworkTables (ntcore) namespace |
CConnectionInfo | NetworkTables Connection Information |
CConnectionNotification | NetworkTables Connection Notification |
CEntryInfo | NetworkTables Entry Information |
CEntryNotification | NetworkTables Entry Notification |
CLogMessage | NetworkTables log message |
CNetworkTable | A network table that knows its subtable path |
CNetworkTableEntry | NetworkTables Entry |
CNetworkTableInstance | NetworkTables Instance |
CRpcAnswer | NetworkTables Remote Procedure Call (Server Side) |
CRpcCall | NetworkTables Remote Procedure Call |
CRpcDefinition | NetworkTables RPC Version 1 Definition |
CRpcParamDef | NetworkTables RPC Version 1 Definition Parameter |
CRpcResultDef | NetworkTables RPC Version 1 Definition Result |
CValue | A network table entry value |
►Nstd | |
Chash< wpi::json > | Hash value for JSON objects |
Cless< ::wpi::detail::value_t > | Specialization for std::less<value_t> |
►Nwpi | WPILib C++ utilities (wpiutil) namespace |
►Ndetail | Detail namespace with internal helper functions |
CAlignerImpl | |
Cconcat_range | Helper to store a sequence of ranges being concatenated and access them |
Cconjunction | |
Cconjunction< B1 > | |
Cconjunction< B1, Bn...> | |
CConstantLog2 | A tiny meta function to compute the log2 of a compile time constant |
CConstantLog2< 1 > | |
CDenseMapPair | |
Cenumerator | |
Cenumerator_iter | |
Cexception | General exception of the json class |
Cexternal_constructor | |
Cexternal_constructor< value_t::array > | |
Cexternal_constructor< value_t::boolean > | |
Cexternal_constructor< value_t::number_float > | |
Cexternal_constructor< value_t::number_integer > | |
Cexternal_constructor< value_t::number_unsigned > | |
Cexternal_constructor< value_t::object > | |
Cexternal_constructor< value_t::string > | |
Cfrom_json_fn | |
Cfwd_or_bidi_tag | Helper which sets its type member to forward_iterator_tag if the category of IterT does not derive from bidirectional_iterator_tag, and to bidirectional_iterator_tag otherwise |
Cfwd_or_bidi_tag_impl | |
Cfwd_or_bidi_tag_impl< true > | |
Chas_from_json | |
Chas_non_default_from_json | |
Chas_to_json | |
CHasPointerLikeTypeTraits | |
CHasPointerLikeTypeTraits< T, decltype((sizeof(PointerLikeTypeTraits< T >)+sizeof(T)), void())> | |
Cindex_sequence | |
Cinternal_iterator | Iterator value |
Cinvalid_iterator | Exception indicating errors with iterators |
Cis_compatible_array_type | |
Cis_compatible_complete_type | |
Cis_compatible_integer_type | |
Cis_compatible_integer_type_impl | |
Cis_compatible_integer_type_impl< true, RealIntegerType, CompatibleNumberIntegerType > | |
Cis_compatible_object_type | |
Cis_compatible_object_type_impl | |
Cis_compatible_object_type_impl< true, RealType, CompatibleObjectType > | |
Cis_compatible_type | |
Cis_complete_type | |
Cis_complete_type< T, decltype(void(sizeof(T)))> | |
Cis_json | |
Cis_json< json > | |
Cis_json_nested_type | |
CIsPointerLike | |
CIsPointerLike< T * > | |
Citer_impl | Template for a bidirectional iterator for the json class |
Citeration_proxy | Proxy class for the items() function |
Cjson_ref | |
Cjson_reverse_iterator | Template for a reverse iterator class |
CLeadingZerosCounter | |
Cmake_index_sequence | |
Cmake_index_sequence< 0 > | |
Cmake_index_sequence< 1 > | |
Cmerge_and_renumber | |
Cmerge_and_renumber< index_sequence< I1...>, index_sequence< I2...> > | |
Cnegation | |
Cother_error | Exception indicating other library errors |
Cout_of_range | Exception indicating access out of the defined range |
Cparse_error | Exception indicating a parse error |
CPopulationCounter | |
CPopulationCounter< T, 8 > | |
Cprimitive_iterator_t | |
Cpriority_tag | |
Cpriority_tag< 0 > | |
Cresult_pair | |
CSafeThreadOwnerBase | |
CSafeThreadProxy | |
CSafeThreadProxyBase | |
CSizerImpl | |
Cstatic_const | |
Cto_json_fn | |
CTrailingZerosCounter | |
Ctype_error | Exception indicating executing a member function with a wrong type |
Czip_common | |
Czip_first | |
Czip_shortest | |
Czippy | |
CZipTupleType | |
►Nhashing | |
►Ndetail | |
Chash_combine_recursive_helper | Helper class to manage the recursive combining of hash_combine arguments |
Chash_state | The intermediate state used during hashing |
Cis_hashable_data | Trait to indicate whether a type's bits can be hashed directly |
Cis_hashable_data< std::pair< T, U > > | |
►Njava | Java Native Interface (JNI) utility functions |
►Ndetail | |
CConvertIntArray | |
CConvertIntArray< T, true > | |
CJArrayRefBase | |
CJArrayRefInner | |
CJArrayRefInner< C, jbyte > | |
CJCallbackManager | |
CJCallbackThread | |
CJClass | |
CJClassInit | |
CJException | |
CJExceptionInit | |
CJGlobal | |
CJLocal | |
CJSingletonCallbackManager | |
CJStringRef | |
►Noptional_detail | |
COptionalStorage | Storage for any type |
COptionalStorage< T, true > | Storage for trivially copyable types only |
►Nsig | |
►Ndetail | |
CNullMutex | |
CSlot | |
CSlot< Func, trait::typelist< Args...> > | |
CSlot< Func, trait::typelist< Connection &, Args...> > | |
CSlot< Pmf, Ptr, trait::typelist< Args...> > | |
CSlot< Pmf, Ptr, trait::typelist< Connection &, Args...> > | |
CSlotBase | |
CSlotPmfTracked | |
CSlotPmfTracked< Pmf, WeakPtr, trait::typelist< Args...> > | |
CSlotState | |
CSlotTracked | |
CSlotTracked< Func, WeakPtr, trait::typelist< Args...> > | |
►Ntrait | |
►Ndetail | |
Cis_callable | |
Cis_callable< F, P, typelist< T...>, void_t< decltype(((*std::declval< P >()).*std::declval< F >())(std::declval< T >()...))> > | |
Cis_callable< F, typelist< T...>, void_t< decltype(std::declval< F >()(std::declval< T >()...))> > | |
Cis_weak_ptr | |
Cis_weak_ptr< T, void_t< decltype(std::declval< T >().expired()), decltype(std::declval< T >().lock()), decltype(std::declval< T >().reset())> > | |
Cis_weak_ptr_compatible | |
Cis_weak_ptr_compatible< T, void_t< decltype(to_weak(std::declval< T >()))> > | |
Cvoider | |
Ctypelist | Represent a list of types |
CConnection | A Connection object allows interaction with an ongoing slot connection |
CConnectionBlocker | ConnectionBlocker is a RAII object that blocks a connection until destruction |
CScopedConnection | ScopedConnection is a RAII version of Connection It disconnects the slot from the signal upon destruction |
CSignalBase | SignalBase is an implementation of the observer pattern, through the use of an emitting object and slots that are connected to the signal and called with supplied arguments when a signal is emitted |
►Nsys | |
►Nfs | |
►Ndetail | |
CDirIterState | Keeps state for the directory_iterator |
CRecDirIterState | Keeps state for the recursive_directory_iterator |
Cbasic_file_status | Represents the result of a call to directory_iterator::status() |
Cdirectory_entry | Directory_entry - A single entry in a directory |
Cdirectory_iterator | Directory_iterator - Iterates through the entries in path |
Cfile_status | Represents the result of a call to sys::fs::status() |
Crecursive_directory_iterator | Recursive_directory_iterator - Same as directory_iterator except for it recurses down into child directories |
CUniqueID | |
►Npath | |
Cconst_iterator | Path iterator |
Creverse_iterator | Reverse path iterator |
►Nuv | |
CAsync | Async handle |
CBuffer | Data buffer |
CCheck | Check handle |
CConnectReq | Connection request |
CError | Error code |
CFsEvent | Filesystem Event handle |
CGetAddrInfoReq | GetAddrInfo request |
CGetNameInfoReq | GetNameInfo request |
CHandle | Handle |
CHandleImpl | Handle |
CIdle | Idle handle |
CLoop | Event loop |
CNetworkStream | Network stream handle |
CNetworkStreamImpl | |
CPipe | Pipe handle |
CPipeConnectReq | Pipe connection request |
CPoll | Poll handle |
CPrepare | Prepare handle |
CProcess | Process handle |
CProcessOptions | Process options |
CRequest | Request |
CRequestImpl | Request |
CShutdownReq | Shutdown request |
CSignal | Signal handle |
CSimpleBufferPool | A simple pool allocator for Buffers |
CStream | Stream handle |
CStreamImpl | |
CTcp | TCP handle |
CTcpConnectReq | TCP connection request |
CTimer | Timer handle |
CTty | TTY handle |
CUdp | UDP handle |
CUdpSendReq | UDP send request |
CWorkReq | Work request |
CWriteReq | Write request |
Cadd_const_past_pointer | If T is a pointer to X, return a pointer to const X |
Cadd_const_past_pointer< T, typename std::enable_if< std::is_pointer< T >::value >::type > | |
Cadd_lvalue_reference_if_not_pointer | If T is a pointer, just return it. If it is not, return T& |
Cadd_lvalue_reference_if_not_pointer< T, typename std::enable_if< std::is_pointer< T >::value >::type > | |
Cadl_serializer | Default JSONSerializer template argument |
CAlignedCharArray | Helper for building an aligned character array type |
CAlignedCharArrayUnion | This union template exposes a suitably aligned and sized character array member which can hold elements of any of up to ten types |
CAlignTo | alignTo for contexts where a constant expression is required |
Care_base_of | Traits class for checking whether type T is a base class for all the given types in the variadic list |
Care_base_of< T, U, Ts...> | |
CArrayRef | ArrayRef - Represent a constant reference to an array (0 or more elements consecutively in memory), i.e |
Cbuffer_ostream | |
Cbuild_index_impl | |
Cbuild_index_impl< 0, I...> | |
Cconcat_iterator | Iterator wrapper that concatenates sequences together |
CConcurrentQueue | |
Cconst_pointer_or_const_ref | |
Cconst_pointer_or_const_ref< T, typename std::enable_if< std::is_pointer< T >::value >::type > | |
►CDebugEpochBase | A base class for data structure classes wishing to make iterators ("handles") pointing into themselves fail-fast |
CHandleBase | A base class for iterator classes ("handles") that wish to poll for iterator invalidating modifications in the underlying data structure |
CDenseMap | |
CDenseMapBase | |
CDenseMapInfo | |
CDenseMapInfo< ArrayRef< T > > | |
CDenseMapInfo< char > | |
CDenseMapInfo< int > | |
CDenseMapInfo< long > | |
CDenseMapInfo< long long > | |
CDenseMapInfo< short > | |
CDenseMapInfo< std::pair< T, U > > | |
CDenseMapInfo< StringRef > | |
CDenseMapInfo< T * > | |
CDenseMapInfo< unsigned > | |
CDenseMapInfo< unsigned long > | |
CDenseMapInfo< unsigned long long > | |
CDenseMapInfo< unsigned short > | |
CDenseMapIterator | |
Cderef | Binary functor that adapts to any other binary functor after dereferencing operands |
Cequal | A functor like C++14's std::equal<void> in its absence |
CErrorOr | Represents either an error or a value T |
CEventLoopRunner | Executes an event loop on a separate thread |
Cfilter_iterator_base | An iterator adaptor that filters the elements of given inner iterators |
Cfilter_iterator_impl | Specialization of filter_iterator_base for forward iteration only |
Cfilter_iterator_impl< WrappedIteratorT, PredicateT, std::bidirectional_iterator_tag > | Specialization of filter_iterator_base for bidirectional iteration |
Cformat_object | |
Cformat_object_base | This is a helper class used for handling formatted output |
CFormattedBytes | |
CFormattedNumber | This is a helper class used for format_hex() and format_decimal() |
CFormattedString | This is a helper class for left_justify, right_justify, and center_justify |
CFreeDeleter | |
Cfunction_ref | An efficient, type-erasing, non-owning reference to a callable |
Cfunction_ref< Ret(Params...)> | |
Cgreater_ptr | |
Chas_rbegin | Metafunction to determine if T& or T has a member called rbegin() |
Chas_rbegin_impl | Helper to determine if type T has a member called rbegin() |
Chash_code | An opaque object representing a hash code |
Chttp_parser | |
Chttp_parser_settings | |
Chttp_parser_url | |
CHttpConnection | |
CHttpLocation | |
CHttpParser | HTTP protocol parser |
CHttpRequest | |
Cidentity | |
Cindex_sequence | Alias for the common case of a sequence of size_ts |
Cindex_sequence_for | Creates a compile-time integer sequence for a parameter pack |
Cinteger_sequence | Represents a compile-time sequence of integers |
CIntrusiveRefCntPtr | A smart pointer to a reference-counted object that inherits from RefCountedBase or ThreadSafeRefCountedBase |
CIntrusiveRefCntPtrInfo | Class you can specialize to provide custom retain/release functionality for a type |
Cis_integral_or_enum | Metafunction that determines whether the given type is either an integral type or an enumeration type, including enum classes |
Cis_one_of | Traits class for checking whether type T is one of any of the given types in the variadic list |
Cis_one_of< T, U, Ts...> | |
CisPodLike | IsPodLike - This is a type trait that is used to determine whether a given type can be copied around with memcpy instead of running ctors etc |
CisPodLike< ArrayRef< T > > | |
CisPodLike< Optional< T > > | |
CisPodLike< std::pair< T, U > > | |
CisPodLike< StringRef > | |
Citerator_adaptor_base | CRTP base class for adapting an iterator to a different type |
►Citerator_facade_base | CRTP base class which implements the entire standard iterator facade in terms of a minimal subset of the interface |
CReferenceProxy | A proxy object for computing a reference via indirecting a copy of an iterator |
Citerator_range | A range adaptor for a pair of iterators |
Cjson | Class to store JSON values |
Cjson_pointer | |
Cless | A functor like C++14's std::less<void> in its absence |
Cless_first | Function object to check whether the first component of a std::pair compares less than the first component of another std::pair |
Cless_ptr | |
Cless_second | Function object to check whether the second component of a std::pair compares less than the second component of another std::pair |
CLogger | |
Cmapped_iterator | |
CMapVector | This class implements a map that also provides access to all stored values in a deterministic order |
CMutableArrayRef | MutableArrayRef - Represent a mutable reference to an array (0 or more elements consecutively in memory), i.e |
CNetworkAcceptor | |
CNetworkStream | |
COptional | |
COwningArrayRef | This is a MutableArrayRef that owns its array |
Cpair_hash | |
Cpointee_iterator | An iterator type that allows iterating over the pointees via some other iterator |
Cpointer_iterator | |
CPointerLikeTypeTraits | A traits type that is used to handle pointer types and things that are just wrappers for pointers as a uniform entity |
CPointerLikeTypeTraits< const T * > | |
CPointerLikeTypeTraits< const T > | |
CPointerLikeTypeTraits< T * > | |
CPointerLikeTypeTraits< uintptr_t > | |
CPointerLikeTypeTraits< void * > | |
Crank | Utility type to build an inheritance chain that makes it easy to rank overload candidates |
Crank< 0 > | |
Craw_fd_istream | |
Craw_fd_ostream | A raw_ostream that writes to a file descriptor |
Craw_istream | |
Craw_mem_istream | |
Craw_null_ostream | A raw_ostream that discards all output |
Craw_os_ostream | Raw_os_ostream - A raw_ostream that writes to an std::ostream |
Craw_ostream | This class implements an extremely fast bulk output stream that can only output to a stream |
Craw_pwrite_stream | An abstract base class for streams implementations that also support a pwrite operation |
Craw_socket_istream | |
Craw_socket_ostream | |
Craw_string_ostream | A raw_ostream that writes to an std::string |
Craw_svector_ostream | A raw_ostream that writes to an SmallVector or SmallString |
Craw_usvector_ostream | A raw_ostream that writes to an SmallVector or SmallString |
Craw_uv_ostream | Raw_ostream style output to a SmallVector of uv::Buffer buffers |
Craw_uvector_ostream | A raw_ostream that writes to a vector |
Craw_vector_ostream | A raw_ostream that writes to a vector |
Crecursive_spinlock1 | A recursive spinlock mutex |
Crecursive_spinlock2 | A recursive spinlock mutex |
CRefCountedBase | A CRTP mixin class that adds reference counting to a type |
CReferenceStorage | Stores a reference that can be changed |
CRoundUpToPowerOfTwo | RoundUpToPowerOfTwo - This is a helper template that rounds N up to the next power of two (which means N itself if N is already a power of two) |
CRoundUpToPowerOfTwoH | RoundUpToPowerOfTwoH - If N is not a power of two, increase it |
CRoundUpToPowerOfTwoH< N, false > | |
CSafeThread | |
CSafeThreadOwner | |
CSameType | |
CSHA1 | |
Csimplify_type | |
Csimplify_type< const IntrusiveRefCntPtr< T > > | |
Csimplify_type< IntrusiveRefCntPtr< T > > | |
CSmallDenseMap | |
CSmallMapVector | A MapVector that performs no allocations if smaller than a certain size |
CSmallPtrSet | SmallPtrSet - This class implements a set which is optimized for holding SmallSize or less elements |
CSmallPtrSetImpl | A templated base class for SmallPtrSet which provides the typesafe interface that is common across all small sizes |
CSmallPtrSetImplBase | SmallPtrSetImplBase - This is the common code shared among all the SmallPtrSet<>'s, which is almost everything |
CSmallPtrSetIterator | SmallPtrSetIterator - This implements a const_iterator for SmallPtrSet |
CSmallPtrSetIteratorImpl | SmallPtrSetIteratorImpl - This is the common base class shared between all instances of SmallPtrSetIterator |
CSmallSet | SmallSet - This maintains a set of unique values, optimizing for the case when the set is small (less than N) |
CSmallSet< PointeeType *, N > | If this set is of pointer values, transparently switch over to using SmallPtrSet for performance |
CSmallString | SmallString - A SmallString is just a SmallVector with methods and accessors that make it work better as a string (e.g |
CSmallVector | This is a 'vector' (really, a variable-sized array), optimized for the case when the array is small |
CSmallVectorBase | This is all the non-templated stuff common to all SmallVectors |
CSmallVectorImpl | This class consists of common code factored out of the SmallVector class to reduce code duplication based on the SmallVector 'N' template parameter |
CSmallVectorStorage | Storage for the SmallVector elements which aren't contained in SmallVectorTemplateCommon |
CSmallVectorStorage< T, 0 > | |
CSmallVectorStorage< T, 1 > | |
CSmallVectorTemplateBase | SmallVectorTemplateBase<isPodLike = false> - This is where we put method implementations that are designed to work with non-POD-like T's |
CSmallVectorTemplateBase< T, true > | SmallVectorTemplateBase<isPodLike = true> - This is where we put method implementations that are designed to work with POD-like T's |
CSmallVectorTemplateCommon | This is the part of SmallVectorTemplateBase which does not depend on whether the type T is a POD |
Cspinlock | A spinlock mutex |
CStringLiteral | A wrapper around a string literal that serves as a proxy for constructing global tables of StringRefs with the length computed at compile time |
CStringMap | StringMap - This is an unconventional map that is specialized for handling keys that are "strings", which are basically ranges of bytes |
CStringMapConstIterator | |
CStringMapEntry | StringMapEntry - This is used to represent one value that is inserted into a StringMap |
CStringMapEntryBase | StringMapEntryBase - Shared base class of StringMapEntry instances |
CStringMapImpl | StringMapImpl - This is the base class of StringMap that is shared among all of its instantiations |
CStringMapIterator | |
CStringMapIterBase | |
CStringMapKeyIterator | |
CStringRef | StringRef - Represent a constant reference to a string, i.e |
CTCPAcceptor | |
CTCPConnector | |
CTCPStream | |
CThreadSafeRefCountedBase | A thread-safe version of RefCountedBase |
CTwine | Twine - A lightweight data structure for efficiently representing the concatenation of temporary values as strings |
CUDPClient | |
CUidVector | |
CUrlParser | Parses a URL into its constiuent components |
Cvalidate_format_parameters | These are templated helper classes used by the format function that capture the object to be formatted and the format string |
Cvalidate_format_parameters< Arg, Args...> | |
Cvalidate_format_parameters<> | |
C_AFD_POLL_HANDLE_INFO | |
C_AFD_POLL_INFO | |
C_uv_barrier | |
CCS_Event | Listener event |
CCS_UsbCameraInfo | USB camera infomation |
CCS_VideoMode | Video mode |
CHAL_CANStreamMessage | Storage for CAN Stream Messages |
CHAL_ControlWord | |
CHAL_JoystickAxes | |
CHAL_JoystickButtons | |
CHAL_JoystickDescriptor | |
CHAL_JoystickPOVs | |
CHAL_MatchInfo | |
CHAL_Value | HAL Entry Value |
Cifaddrs | |
CLog | |
CNT_ConnectionInfo | NetworkTables Connection Information |
CNT_ConnectionNotification | NetworkTables Connection Notification |
CNT_EntryInfo | NetworkTables Entry Information |
CNT_EntryNotification | NetworkTables Entry Notification |
CNT_LogMessage | NetworkTables log message |
CNT_RpcAnswer | NetworkTables RPC Call Data |
CNT_RpcDefinition | NetworkTables RPC Version 1 Definition |
CNT_RpcParamDef | NetworkTables RPC Version 1 Definition Parameter |
CNT_RpcResultDef | NetworkTables RPC Version 1 Definition Result |
CNT_String | A NetworkTables string |
CNT_Value | NetworkTables Entry Value |
Cpthread_barrier_t | |
Cuv__dirent_s | |
Cuv__io_s | |
Cuv__work | |
Cuv_any_handle | |
Cuv_any_req | |
Cuv_async_s | |
Cuv_barrier_t | |
Cuv_buf_t | It should be possible to cast uv_buf_t[] to WSABUF[] see http://msdn.microsoft.com/en-us/library/ms741542(v=vs.85).aspx |
Cuv_check_s | |
Cuv_cond_t | |
Cuv_connect_s | |
Cuv_cpu_info_s | |
Cuv_cpu_times_s | |
Cuv_dirent_s | |
Cuv_fs_event_s | |
Cuv_fs_poll_s | |
Cuv_fs_s | |
Cuv_getaddrinfo_s | |
Cuv_getnameinfo_s | |
Cuv_handle_s | |
Cuv_idle_s | |
Cuv_interface_address_s | |
Cuv_key_t | |
Cuv_lib_t | |
Cuv_loop_s | |
Cuv_once_s | |
Cuv_passwd_s | |
Cuv_pipe_s | |
Cuv_poll_s | |
Cuv_prepare_s | |
Cuv_process_options_s | |
Cuv_process_s | |
Cuv_req_s | |
Cuv_rusage_t | |
Cuv_rwlock_t | |
Cuv_shutdown_s | |
Cuv_signal_s | |
Cuv_stat_t | |
Cuv_stdio_container_s | |
Cuv_stream_s | |
Cuv_tcp_s | |
Cuv_timer_s | |
Cuv_timespec_t | |
Cuv_timeval_t | |
Cuv_tty_s | |
Cuv_udp_s | |
Cuv_udp_send_s | |
Cuv_work_s | |
Cuv_write_s | |