►Ncs | |
CAxisCamera | A source that represents an Axis IP camera |
CAxisCameraImpl | |
CCvSink | A sink for user code to accept video frames as OpenCV images |
CCvSinkImpl | |
CCvSource | A source for user code to provide OpenCV images as video frames |
►CCvSourceImpl | |
CPropertyData | |
►Cdefault_init_allocator | |
Crebind | |
CFrame | |
CHandle | |
CHttpCamera | A source that represents a MJPEG-over-HTTP (IP) camera |
►CHttpCameraImpl | |
CPropertyData | |
CImage | |
CLogger | |
CMjpegServer | A sink that acts as a MJPEG-over-HTTP network server |
►CMjpegServerImpl | |
CConnThread | |
►CNetworkListener | |
CThread | |
►CNotifier | |
►CThread | |
CListener | |
CPropertyImpl | |
CRawEvent | Listener event |
CSinkData | |
CSinkImpl | |
CSinks | |
CSourceData | |
CSourceImpl | |
CSources | |
CStaticUnlimitedHandleResource | |
CUnlimitedHandleResource | |
CUsbCamera | A source that represents a USB camera |
CUsbCameraBuffer | |
►CUsbCameraImpl | |
CMessage | |
CUsbCameraInfo | USB camera information |
CUsbCameraProperty | |
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 | |
CVideoSink | A sink for video that accepts a sequence of frames |
CVideoSource | A source for video that provides a sequence of frames |
►Nfrc | |
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 |
CCancelButtonScheduler | |
CCANSpeedController | Interface for "smart" CAN-based speed controllers |
CCircularBuffer | 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 |
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 |
CHardwareHLReporting | |
CHasBeenMoved | |
CHeldButtonScheduler | |
CHLUsageReporting | |
CHLUsageReportingInterface | |
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 |
CLiveWindowComponent | |
CLiveWindowSendable | Live Window Sendable is a special type of object sendable to the live window |
CMecanumDrive | A class for driving Mecanum drive platforms |
CMotorSafety | |
CMotorSafetyHelper | |
CNamedSendable | The interface for sendable objects that gives the sendable a default name in the Smart Dashboard |
CNetworkButton | |
CNotifier | |
CNullDeleter | |
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 |
CRelay | Class for Spike style relay outputs |
CReleasedButtonScheduler | |
CResource | Convenient way to track allocated resources |
CRobotBase | Implement a Robot Program framework |
CRobotDriveBase | Common base class for drive platforms |
CRobotState | |
CRobotStateInterface | |
CSafePWM | A safe version of the PWM class |
CSampleRobot | |
CScheduler | |
CSD540 | Mindsensors SD540 Speed Controller |
CSendable | |
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 |
CSensorBase | Base class for all sensors |
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 | |
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 | |
CXboxController | Handle input from Xbox 360 or Xbox One controllers connected to the Driver Station |
►Nllvm | |
►Ndetail | |
CAlignerImpl | |
CAlignmentCalcImpl | |
CAlignmentCalcImpl< T, true > | |
CAlignmentCalcImplBase | |
CConstantLog2 | A tiny meta function to compute the log2 of a compile time constant |
CConstantLog2< 1 > | |
CDenseMapPair | |
CLeadingZerosCounter | |
CPopulationCounter | |
CPopulationCounter< T, 8 > | |
CSizerImpl | |
►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 > > | |
►Nsys | |
►Npath | |
Cconst_iterator | Path iterator |
Creverse_iterator | Reverse path iterator |
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 > | |
CAlignedCharArrayUnion | This union template exposes a suitably aligned and sized character array member which can hold elements of any of up to ten types |
CAlignOf | AlignOf - A templated class that contains an enum value representing the alignment of the template argument |
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... > | |
CCachedHash | |
►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< CachedHash< T > > | |
CDenseMapInfo< char > | |
CDenseMapInfo< int > | |
CDenseMapInfo< long > | |
CDenseMapInfo< long long > | |
CDenseMapInfo< std::pair< T, U > > | |
CDenseMapInfo< StringRef > | |
CDenseMapInfo< T * > | |
CDenseMapInfo< unsigned > | |
CDenseMapInfo< unsigned long > | |
CDenseMapInfo< unsigned long long > | |
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 |
Cformat_object | These are templated helper classes used by the format function that capture the object to be formated and the format string |
Cformat_object_base | This is a helper class used for handling formatted output |
CFormattedNumber | This is a helper class used for format_hex() and format_decimal() |
CFormattedString | This is a helper class used for left_justify() and right_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 type T has a member called rbegin() |
Chash_code | An opaque object representing a hash code |
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 |
Cis_integral_or_enum | Metafunction that determines whether the given type is either an integral type or an enumeration type, including enum classes |
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_range | A range adaptor for a pair of iterators |
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 |
Cmapped_iterator | |
CMutableArrayRef | MutableArrayRef - Represent a mutable reference to an array (0 or more elements consecutively in memory), i.e |
COptional | |
Cpair_hash | |
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< T * > | |
CPointerLikeTypeTraits< uintptr_t > | |
CPointerLikeTypeTraits< void * > | |
Craw_fd_ostream | A raw_ostream that writes to a file descriptor |
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_string_ostream | A raw_ostream that writes to an std::string |
Craw_svector_ostream | A raw_ostream that writes to an SmallVector or SmallString |
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 > | |
CSmallDenseMap | |
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 |
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 | |
CStringRef | StringRef - Represent a constant reference to a string, i.e |
CTwine | Twine - A lightweight data structure for efficiently representing the concatenation of temporary values as strings |
►Nnt | |
►Nimpl | |
►CCallbackThread | |
CPoller | |
CConnectionNotifierThread | |
CEntryListenerData | |
CEntryNotifierThread | |
CListenerData | |
CLoggerListenerData | |
CLoggerThread | |
CRpcNotifierData | |
CRpcServerThread | |
CCallbackManager | |
CConnectionInfo | NetworkTables Connection Information |
CConnectionNotification | NetworkTables Connection Notification |
CConnectionNotifier | |
CDispatcher | |
CDispatcherBase | |
►CDsClient | |
CThread | |
CEntryInfo | NetworkTables Entry Information |
CEntryNotification | NetworkTables Entry Notification |
CEntryNotifier | |
CHandle | |
CIConnectionNotifier | |
CIDispatcher | |
CIEntryNotifier | |
CINetworkConnection | |
CInstanceImpl | |
CIRpcServer | |
CIStorage | |
CLoggerImpl | |
CLogMessage | NetworkTables log message |
CMessage | |
CNetworkConnection | |
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 |
CRpcServer | |
CSequenceNumber | |
CStorage | |
CValue | A network table entry value |
CWireDecoder | |
CWireEncoder | |
►Nstd | |
Chash< wpi::json > | Hash value for JSON objects |
Cless<::wpi::detail::value_t > | Specialization for std::less<value_t> |
►Nwpi | |
►Ndetail | Unnamed namespace with internal helper functions |
Cconjunction | |
Cconjunction< B1 > | |
Cconjunction< B1, Bn... > | |
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 | |
Cinvalid_iterator | Exception indicating errors with iterators |
Cis_compatible_array_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_json_nested_type | |
Cnegation | |
Cother_error | Exception indicating other errors |
Cout_of_range | Exception indicating access out of the defined range |
Cparse_error | Exception indicating a parse error |
Cpriority_tag | |
Cpriority_tag< 0 > | |
CSafeThreadOwnerBase | |
CSafeThreadProxy | |
CSafeThreadProxyBase | |
Cstatic_const | |
Cto_json_fn | |
Ctype_error | Exception indicating executing a member function with a wrong type |
►Njava | |
►Ndetail | |
CConvertIntArray | |
CConvertIntArray< T, true > | |
CJArrayRefBase | |
CJArrayRefInner | |
CJArrayRefInner< C, jbyte > | |
CJCallbackManager | |
CJCallbackThread | |
CJClass | |
CJException | |
CJLocal | |
CJSingletonCallbackManager | |
CJStringRef | |
CConcurrentQueue | |
CHttpConnection | |
CHttpLocation | |
CHttpRequest | |
►Cjson | Class to store JSON values |
Cbinary_writer | Serialization to CBOR and MessagePack values |
Citer_impl | Template for a random access iterator for the json class |
Cjson_pointer | JSON Pointer |
Cjson_value | JSON value |
Cparser | Syntax analysis |
Cserializer | Wrapper around the serialization functions |
CLogger | |
CNetworkAcceptor | |
CNetworkStream | |
Craw_fd_istream | |
Craw_istream | |
Craw_mem_istream | |
Craw_socket_istream | |
Craw_socket_ostream | |
CSafeThread | |
CSafeThreadOwner | |
CSHA1 | |
CTCPAcceptor | |
CTCPConnector | |
CTCPStream | |
CUidVector | |
CAlignedCharArray | Helper for building an aligned character array type |
CCS_Event | |
CCS_UsbCameraInfo | |
CCS_VideoMode | |
CJGlobal | |
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 |