►Ncs | CameraServer (cscore) namespace |
CAxisCamera | A source that represents an Axis IP camera |
CHttpCamera | A source that represents a MJPEG-over-HTTP (IP) camera |
CImageSink | A base class for single image reading sinks |
CImageSource | A base class for single image providing sources |
CMjpegServer | A sink that acts as a MJPEG-over-HTTP network server |
CRawCvSink | A sink for user code to accept raw video frames as OpenCV images |
CRawCvSource | A source for using the raw frame API to provide opencv images |
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 | A class that enforces constraints on the differential drive kinematics |
►Ndetail | |
CListenerExecutor | An executor for running listener tasks posted by Sendable listeners synchronously from the main application thread |
CRecordingController | |
CShuffleboardInstance | |
►Nsim | |
CAccelerometerSim | |
CAnalogGyroSim | |
CAnalogInSim | |
CAnalogOutSim | |
CAnalogTriggerSim | |
CCallbackStore | |
CDigitalPWMSim | |
CDIOSim | |
CDriverStationSim | |
CDutyCycleSim | |
CEncoderSim | |
CPCMSim | |
CPDPSim | |
CPWMSim | |
CRelaySim | |
CRoboRioSim | |
CSimDeviceSim | |
CSPIAccelerometerSim | |
CAccelerometer | Interface for 3-axis accelerometers |
►CAddressableLED | A class for driving addressable LEDs, such as WS2812s and NeoPixels |
CLEDData | |
►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 |
CAnalogEncoder | Class for supporting continuous analog encoders, such as the US Digital MA3 |
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 |
CArmFeedforward | A helper class that computes feedforward outputs for a simple arm (modeled as a motor acting against the force of gravity on a beam suspended at an angle) |
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 | |
CCentripetalAccelerationConstraint | A constraint on the maximum absolute centripetal acceleration allowed when traversing a trajectory |
CChassisSpeeds | Represents the speed of a robot chassis |
CColor | Represents colors that can be used with Addressable LEDs |
CColor8Bit | Represents colors that can be used with Addressable LEDs |
CCommand | At the very core of the entire command framework |
CCommandGroup | A CommandGroup is a list of commands which are executed in sequence |
CCommandGroupEntry | |
CComplexWidget | A Shuffleboard widget that handles a Sendable object such as a speed controller or sensor |
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 |
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 |
CCubicHermiteSpline | Represents a hermite spline of degree 3 |
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 |
CDifferentialDriveKinematics | Helper class that converts a chassis velocity (dx and dtheta components) to left and right wheel velocities for a differential drive |
CDifferentialDriveKinematicsConstraint | |
CDifferentialDriveOdometry | Class for differential drive odometry |
CDifferentialDriveVoltageConstraint | A class that enforces constraints on differential drive voltage expenditure based on the motor dynamics and the drive kinematics |
CDifferentialDriveWheelSpeeds | Represents the wheel speeds for a differential drive drivetrain |
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 |
CDMA | |
CDMASample | |
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 |
CDutyCycle | Class to read a duty cycle PWM input |
CDutyCycleEncoder | Class for supporting duty cycle/PWM encoders, such as the US Digital MA3 with PWM Output, the CTRE Mag Encoder, the Rev Hex Encoder, and the AM Mag Encoder |
CElevatorFeedforward | A helper class that computes feedforward outputs for a simple elevator (modeled as a motor acting against the force of gravity) |
CEncoder | Class to read quad encoders |
CError | Error object represents a library error |
CErrorBase | Base class for most objects |
CField2d | 2D representation of game field (for simulation) |
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 |
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 |
CLayoutType | Represents the type of a layout in Shuffleboard |
CLinearDigitalFilter | This class implements a linear, digital filter |
CLinearFilter | 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 |
CMecanumDriveKinematics | Helper class that converts a chassis velocity (dx, dy, and dtheta components) into individual wheel speeds |
CMecanumDriveKinematicsConstraint | |
CMecanumDriveOdometry | Class for mecanum drive odometry |
CMecanumDriveWheelSpeeds | Represents the wheel speeds for a mecanum drive drivetrain |
CMedianFilter | A class that implements a moving-window median filter |
CMotorSafety | This base class runs a watchdog timer and calls the subclass's StopMotor() function if the timeout expires |
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) |
CPose2d | Represents a 2d pose containing translational and rotational elements |
CPotentiometer | Interface for potentiometers |
CPOVButton | |
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 | |
CProfiledPIDController | Implements a PID control loop whose setpoint is constrained by a trapezoid profile |
CPWM | Class implements the PWM generation in the FPGA |
CPWMSparkMax | REV Robotics SPARK MAX Speed Controller |
CPWMSpeedController | Common base class for all PWM Speed Controllers |
CPWMTalonFX | Cross the Road Electronics (CTRE) Talon FX Speed Controller with PWM control |
CPWMTalonSRX | Cross the Road Electronics (CTRE) Talon SRX Speed Controller with PWM control |
CPWMVenom | Playing with Fusion Venom Smart Motor with PWM control |
CPWMVictorSPX | Cross the Road Electronics (CTRE) Victor SPX Speed Controller with PWM control |
CQuinticHermiteSpline | Represents a hermite spline of degree 5 |
CRamseteController | Ramsete is a nonlinear time-varying feedback controller for unicycle models that drives the model to a desired pose along a two-dimensional trajectory |
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 | |
CRotation2d | A rotation in a 2d coordinate frame represented a point on the unit circle (cosine and sine) |
CScheduler | |
CSD540 | Mindsensors SD540 Speed Controller |
CSendable | Interface for Sendable objects |
CSendableBase | |
CSendableBuilder | |
CSendableBuilderImpl | |
CSendableCameraWrapper | A wrapper to make video sources sendable and usable from Shuffleboard |
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 |
CSendableHelper | A helper class for use with objects that add themselves to SendableRegistry |
►CSendableRegistry | Public interface for registering sensors and actuators for use on dashboards and LiveWindow |
CCallbackData | Data passed to ForeachLiveWindow() callback function |
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 |
CShuffleboard | Mechanism with which data can be added and laid out in the Shuffleboard dashboard application from a robot program |
CShuffleboardComponent | A generic component in Shuffleboard |
CShuffleboardComponentBase | A shim class to allow storing ShuffleboardComponents in arrays |
CShuffleboardContainer | Common interface for objects that can contain shuffleboard components |
CShuffleboardLayout | A layout in a Shuffleboard tab |
CShuffleboardRoot | The root of the data placed in Shuffleboard |
CShuffleboardTab | Represents a tab in the Shuffleboard dashboard |
CShuffleboardValue | |
CShuffleboardWidget | Abstract superclass for widgets |
CSimpleMotorFeedforward | A helper class that computes feedforward voltages for a simple permanent-magnet DC motor |
CSimpleWidget | A Shuffleboard widget that handles a single data point such as a number or string |
CSlewRateLimiter | A class that limits the rate of change of an input value |
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 SPARK Speed Controller |
CSpeedController | Interface for speed controlling devices |
CSpeedControllerGroup | |
CSPI | SPI bus interface class |
►CSpline | Represents a two-dimensional parametric spline that interpolates between two points |
CControlVector | Represents a control vector for a spline |
CSplineHelper | Helper class that is used to generate cubic and quintic splines from user provided waypoints |
►CSplineParameterizer | Class used to parameterize a spline by its arc length |
CMalformedSplineException | |
CStartCommand | |
CSubsystem | |
CSuppliedValueWidget | |
CSwerveDriveKinematics | Helper class that converts a chassis velocity (dx, dy, and dtheta components) into individual module states (speed and angle) |
CSwerveDriveKinematicsConstraint | |
CSwerveDriveOdometry | Class for swerve drive odometry |
CSwerveModuleState | Represents the state of one swerve module |
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 | |
►CTrajectory | Represents a time-parameterized trajectory |
CState | Represents one point on the trajectory |
CTrajectoryConfig | Represents the configuration for generating a trajectory |
►CTrajectoryConstraint | An interface for defining user-defined velocity and acceleration constraints while generating trajectories |
CMinMax | Represents a minimum and maximum acceleration |
CTrajectoryGenerator | Helper class used to generate trajectories with various constraints |
CTrajectoryParameterizer | Class used to parameterize a trajectory by time |
CTrajectoryUtil | |
CTransform2d | Represents a transformation for a Pose2d |
CTranslation2d | Represents a translation in 2d space |
►CTrapezoidProfile | A trapezoid-shaped velocity profile |
CConstraints | |
CState | |
CTrigger | This class provides an easy way to link commands to inputs |
CTwist2d | A change in distance along arc since the last pose update |
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 |
CWidgetType | Represents the type of a widget in Shuffleboard |
CXboxController | Handle input from Xbox 360 or Xbox One controllers connected to the Driver Station |
►Nfrc2 | |
CButton | A class used to bind command scheduling to button presses |
CCommand | A state machine representing a complete action to be performed by the robot |
CCommandBase | A Sendable base class for Commands |
CCommandGroupBase | A base for CommandGroups |
CCommandHelper | CRTP implementation to allow polymorphic decorator functions in Command |
CCommandScheduler | The scheduler responsible for running Commands |
CCommandState | Class that holds scheduling state for a command |
CConditionalCommand | Runs one of two commands, depending on the value of the given condition when this command is initialized |
CFunctionalCommand | A command that allows the user to pass in functions for each of the basic command methods through the constructor |
CInstantCommand | A Command that runs instantly; it will initialize, execute once, and end on the same iteration of the scheduler |
CJoystickButton | A class used to bind command scheduling to joystick button presses |
CMecanumControllerCommand | A command that uses two PID controllers (PIDController) and a ProfiledPIDController (ProfiledPIDController) to follow a trajectory Trajectory with a mecanum drive |
CNotifierCommand | A command that starts a notifier to run the given runnable periodically in a separate thread |
CParallelCommandGroup | A CommandGroup that runs a set of commands in parallel, ending when the last command ends |
CParallelDeadlineGroup | A CommandGroup that runs a set of commands in parallel, ending only when a specific command (the "deadline") ends, interrupting all other commands that are still running at that point |
CParallelRaceGroup | A CommandGroup that runs a set of commands in parallel, ending when any one of the commands ends and interrupting all the others |
CPerpetualCommand | A command that runs another command in perpetuity, ignoring that command's end conditions |
CPIDCommand | A command that controls an output with a PIDController |
CPIDController | Implements a PID control loop |
CPIDSubsystem | A subsystem that uses a PIDController to control an output |
CPOVButton | A class used to bind command scheduling to joystick POV presses |
CPrintCommand | A command that prints a string when initialized |
CProfiledPIDCommand | A command that controls an output with a ProfiledPIDController |
CProfiledPIDSubsystem | A subsystem that uses a ProfiledPIDController to control an output |
CProxyScheduleCommand | Schedules the given commands when this command is initialized, and ends when all the commands are no longer scheduled |
CRamseteCommand | A command that uses a RAMSETE controller to follow a trajectory with a differential drive |
CRunCommand | A command that runs a Runnable continuously |
CScheduleCommand | Schedules the given commands when this command is initialized |
CSelectCommand | Runs one of a selection of commands, either using a selector and a key to command mapping, or a supplier that returns the command directly at runtime |
CSequentialCommandGroup | A CommandGroups that runs a list of commands in sequence |
CStartEndCommand | A command that runs a given runnable when it is initalized, and another runnable when it ends |
CSubsystem | A robot subsystem |
CSubsystemBase | A base for subsystems that handles registration in the constructor, and provides a more intuitive method for setting the default command |
CSwerveControllerCommand | A command that uses two PID controllers (PIDController) and a ProfiledPIDController (ProfiledPIDController) to follow a trajectory Trajectory with a swerve drive |
CTimer | A wrapper for the frc::Timer class that returns unit-typed values |
CTrapezoidProfileCommand | A command that runs a TrapezoidProfile |
CTrapezoidProfileSubsystem | A subsystem that generates and runs trapezoidal motion profiles automatically |
CTrigger | A class used to bind command scheduling to events |
CWaitCommand | A command that does nothing but takes a specified amount of time to finish |
CWaitUntilCommand | A command that does nothing but ends after a specified match time or condition |
►Nhal | WPILib Hardware Abstraction Layer (HAL) namespace |
►Nimpl | |
CSimCallbackRegistryBase | |
CSimDataValueBase | |
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 |
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 |
CSimCallbackRegistry | Simulation callback registry |
CSimDataValue | Simulation data value wrapper |
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 |
Cis_error_code_enum< wpi::errc > | |
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 |
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 | |
CFutureThen | |
CFutureThen< To, void > | |
CFutureThen< void, From > | |
CFutureThen< void, void > | |
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())> | |
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 | |
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 > | |
CPromiseFactoryBase | |
Cresult_pair | |
CSafeThreadOwnerBase | |
CSafeThreadProxy | |
CSafeThreadProxyBase | |
CSizerImpl | |
Cstatic_const | |
Cto_json_fn | |
CTrailingZerosCounter | |
Ctype_error | Exception indicating executing a member function with a wrong type |
CWorkerThreadAsync | |
CWorkerThreadAsync< void > | |
CWorkerThreadRequest | |
CWorkerThreadThread | |
Czip_common | |
Czip_first | |
Czip_longest_iterator | |
Czip_longest_range | |
Czip_shortest | |
CZipLongestItemType | |
CZipLongestTupleType | |
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 > > | |
►Nimpl | |
CUidVectorIterator | |
►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 | |
►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 |
►Nsupport | |
►Ndetail | |
►Cpacked_endian_specific_integral | |
Cref | |
CPickAlignment | ::value is either alignment, or alignof(T) if alignment is 0 |
►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() |
Cmapped_file_region | This class represents a memory mapped file |
Crecursive_directory_iterator | Recursive_directory_iterator - Same as directory_iterator except for it recurses down into child directories |
Cspace_info | Space_info - Self explanatory |
CUniqueID | |
►Npath | |
Cconst_iterator | Path iterator |
Creverse_iterator | Reverse path iterator |
►Nuv | |
CAsync | Async handle |
CAsync<> | Async specialization for no data parameters |
CAsyncFunction | |
CAsyncFunction< R(T...)> | Function 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 |
COption | Structure for Spawn() option temporaries |
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 | |
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 |
Cfrom_value | |
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 | |
Ccircular_buffer | This is a simple circular buffer so we don't need to "bucket brigade" copy old values |
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< hash_code > | |
CDenseMapInfo< int > | |
CDenseMapInfo< long > | |
CDenseMapInfo< long long > | |
CDenseMapInfo< PointerIntPair< PointerTy, IntBits, IntType > > | |
CDenseMapInfo< PointerUnion< T, U > > | |
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 |
CECError | This class wraps a std::error_code in a Error |
CError | Lightweight error class with error context and mandatory checking |
CErrorAsOutParameter | Helper for Errors used as out-parameters |
CErrorHandlerTraits | Helper for testing applicability of, and applying, handlers for ErrorInfo types |
CErrorHandlerTraits< Error(&)(ErrT &)> | |
CErrorHandlerTraits< Error(&)(std::unique_ptr< ErrT >)> | Specialization for functions of the form 'Error (std::unique_ptr<ErrT>)' |
CErrorHandlerTraits< RetT(C::*)(const ErrT &) const > | |
CErrorHandlerTraits< RetT(C::*)(const ErrT &)> | |
CErrorHandlerTraits< RetT(C::*)(ErrT &) const > | |
CErrorHandlerTraits< RetT(C::*)(ErrT &)> | |
CErrorHandlerTraits< RetT(C::*)(std::unique_ptr< ErrT >) const > | Specialization for member functions of the form 'RetT (std::unique_ptr<ErrT>) const' |
CErrorHandlerTraits< RetT(C::*)(std::unique_ptr< ErrT >)> | Specialization for member functions of the form 'RetT (std::unique_ptr<ErrT>)' |
CErrorHandlerTraits< void(&)(ErrT &)> | |
CErrorHandlerTraits< void(&)(std::unique_ptr< ErrT >)> | Specialization for functions of the form 'void (std::unique_ptr<ErrT>)' |
CErrorInfo | Base class for user error types |
CErrorInfoBase | Base class for error info classes |
CErrorList | Special ErrorInfo subclass representing a list of ErrorInfos |
CErrorOr | Represents either an error or a value T |
CErrorSuccess | Subclass of Error for the sole purpose of identifying the success path in the type system |
CEventLoopRunner | Executes an event loop on a separate thread |
CExitOnError | Helper for check-and-exit error handling |
CExpected | Tagged union holding either a T or a Error |
CExpectedAsOutParameter | Helper for Expected<T>s used as out-parameters |
CFileError | This class wraps a filename and another Error |
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...)> | |
CFunctionPointerLikeTypeTraits | Provide suitable custom traits struct for function pointers |
Cfuture | A lightweight version of std::future |
Cfuture< void > | Explicit specialization for future<void> |
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 | |
CHttpMultipartScanner | |
CHttpParser | HTTP protocol parser |
CHttpRequest | |
CHttpServerConnection | |
Cidentity | |
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< PointerIntPair< PointerTy, IntBits, IntType > > | |
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_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 | |
Cmake_const_ptr | |
Cmake_const_ref | |
CManagedStatic | ManagedStatic - This transparently changes the behavior of global statics to be lazily constructed on demand (good for reducing startup times of dynamic libraries that link in LLVM components) and for making destruction be explicit through the wpi_shutdown() function call |
CManagedStaticBase | ManagedStaticBase - Common base class for ManagedStatic instances |
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 | |
Cobject_creator | Object_creator - Helper method for ManagedStatic |
Cobject_deleter | Object_deleter - Helper method for ManagedStatic |
Cobject_deleter< T[N]> | |
Con_first | Function object to apply a binary function to the first component of a std::pair |
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 | |
CPointerIntPair | PointerIntPair - This class implements a pair of a pointer and small integer |
CPointerIntPairInfo | |
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< PointerIntPair< PointerTy, IntBits, IntType, PtrTraits > > | |
CPointerLikeTypeTraits< PointerUnion3< PT1, PT2, PT3 > > | |
CPointerLikeTypeTraits< PointerUnion4< PT1, PT2, PT3, PT4 > > | |
CPointerLikeTypeTraits< PointerUnion< PT1, PT2 > > | |
CPointerLikeTypeTraits< ReturnT(*)(ParamTs...)> | Provide a default specialization for function pointers that assumes 4-byte alignment |
CPointerLikeTypeTraits< T * > | |
CPointerLikeTypeTraits< uintptr_t > | |
CPointerLikeTypeTraits< void * > | |
CPointerUnion | A discriminated union of two pointer types, with the discriminator in the low bit of the pointer |
CPointerUnion3 | A pointer union of three pointer types |
CPointerUnion4 | A pointer union of four pointer types |
CPointerUnionTypeSelector | Get a type based on whether two types are the same or not |
CPointerUnionTypeSelector< T, T, RET_EQ, RET_NE > | |
CPointerUnionTypeSelectorReturn | |
CPointerUnionTypeSelectorReturn< PointerUnionTypeSelector< T1, T2, RET_EQ, RET_NE > > | |
CPointerUnionUIntTraits | Provide PointerLikeTypeTraits for void* that is used by PointerUnion for the two template arguments |
CPortForwarder | Forward ports to another host |
CPriorityQueue | This class adds a method for removing all elements from the priority queue matching the given value |
Cpromise | A lightweight version of std::promise |
Cpromise< void > | Explicit specialization for promise<void> |
CPromiseFactory | A promise factory for lightweight futures |
CPromiseFactory< void > | Explicit specialization for PromiseFactory<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 |
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 | |
CScopedFatalErrorHandler | ScopedFatalErrorHandler - This is a simple helper class which just calls install_fatal_error_handler in its constructor and remove_fatal_error_handler in its destructor |
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 |
CSmallSetIterator | SmallSetIterator - This class implements a const_iterator for SmallSet by delegating to the underlying SmallVector or Set iterators |
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 |
CSmallVectorAlignmentAndSize | Figure out the offset of the first element |
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 |
CSmallVectorStorage< T, 0 > | We need the storage to be properly aligned even for small-size of 0 so that the pointer math in SmallVectorTemplateCommon::getFirstEl() is well-defined |
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 |
CStringError | This class wraps a string in an Error |
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 | |
Cunique_function | |
Cunique_function< ReturnT(ParamTs...)> | |
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<> | |
CVersionTuple | Represents a version number in the form major[.minor[.subminor[.build]]] |
►CWebSocket | RFC 6455 compliant WebSocket client and server implementation |
CClientOptions | Client connection options |
►CWebSocketServer | Dedicated WebSocket server |
CServerOptions | Server options |
CWebSocketServerHelper | WebSocket HTTP server helper |
CWorkerThread | |
CWorkerThread< R(T...)> | |
Cwpi_shutdown_obj | Wpi_shutdown_obj - This is a simple helper class that calls wpi_shutdown() when it is destroyed |
CCS_Event | Listener event |
CCS_RawFrame | Raw Frame |
CCS_UsbCameraInfo | USB camera infomation |
CCS_VideoMode | Video mode |
CHAL_AddressableLEDData | |
CHAL_CANStreamMessage | Storage for CAN Stream Messages |
CHAL_ControlWord | |
CHAL_DMASample | |
CHAL_JoystickAxes | |
CHAL_JoystickButtons | |
CHAL_JoystickDescriptor | |
CHAL_JoystickPOVs | |
CHAL_MatchInfo | |
CHAL_Value | HAL Entry Value |
CHALSIM_NotifierInfo | |
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 |