 _TALON_Control_1_General_10ms_t | Control |
 _TALON_Control_3_ClearFlags_OneShot_t | |
 _TALON_Control_5_General_10ms_t | |
 _TALON_Control_6_MotProfAddTrajPoint_huff0_t | |
 _TALON_Control_6_MotProfAddTrajPoint_huff1_t | |
 _TALON_Control_6_MotProfAddTrajPoint_t | |
 _TALON_Param_Request_t | |
 _TALON_Param_Response_t | |
 _TALON_Status_1_General_10ms_t | Status |
 _TALON_Status_2_Feedback_20ms_t | |
 _TALON_Status_3_Enc_100ms_t | |
 _TALON_Status_4_AinTempVbat_100ms_t | |
 _TALON_Status_5_Startup_OneShot_t | |
 _TALON_Status_6_Eol_t | |
 _TALON_Status_7_Debug_200ms_t | |
 _TALON_Status_8_PulseWid_100ms_t | |
 _TALON_Status_9_MotProfBuffer_100ms_t | |
 Accelerometer | Interface for 3-axis accelerometers |
  ADXL345_I2C | ADXL345 Accelerometer on I2C |
  ADXL345_SPI | ADXL345 Accelerometer on SPI |
  ADXL362 | ADXL362 SPI Accelerometer |
  BuiltInAccelerometer | Built-in accelerometer |
 llvm::add_const_past_pointer< T, Enable > | If T is a pointer to X, return a pointer to const X |
 llvm::add_const_past_pointer< T, typename std::enable_if< std::is_pointer< T >::value >::type > | |
 llvm::add_lvalue_reference_if_not_pointer< T, Enable > | If T is a pointer, just return it. If it is not, return T& |
 llvm::add_lvalue_reference_if_not_pointer< T, typename std::enable_if< std::is_pointer< T >::value >::type > | |
 AlignedCharArray | Helper for building an aligned character array type |
 AlignedCharArray | |
  llvm::AlignedCharArrayUnion< BucketT[InlineBuckets], LargeRep > | |
  llvm::AlignedCharArrayUnion< char > | |
  llvm::AlignedCharArrayUnion< T > | |
  llvm::AlignedCharArrayUnion< T1, T2, T3, T4, T5, T6, T7, T8, T9, T10 > | This union template exposes a suitably aligned and sized character array member which can hold elements of any of up to ten types |
 llvm::detail::AlignerImpl< T1, T2, T3, T4, T5, T6, T7, T8, T9, T10 > | |
 llvm::AlignmentCalcImpl< T > | |
 llvm::AlignOf< T > | AlignOf - A templated class that contains an enum value representing the alignment of the template argument |
 ADXL345_SPI::AllAxes | |
 ADXL362::AllAxes | |
 ADXL345_I2C::AllAxes | |
 llvm::ArrayRef< T > | ArrayRef - Represent a constant reference to an array (0 or more elements consecutively in memory), i.e |
  llvm::MutableArrayRef< T > | MutableArrayRef - Represent a mutable reference to an array (0 or more elements consecutively in memory), i.e |
 ButtonScheduler | |
  CancelButtonScheduler | |
  HeldButtonScheduler | |
  PressedButtonScheduler | |
  ReleasedButtonScheduler | |
  ToggleButtonScheduler | |
 CANInterfacePlugin | |
 CircularBuffer< T > | This is a simple circular buffer so we don't need to "bucket brigade" copy old values |
 CircularBuffer< double > | |
 ColorReport_struct | Tracking functions return this structure |
 CommandGroupEntry | |
 ConcurrentQueue< T > | |
 ConcurrentQueue< Outgoing > | |
 nt::ConnectionInfo | NetworkTables Connection Information |
 Notifier::Thread::ConnectionNotification | |
 Controller | Interface for Controllers Common interface for controllers |
  PIDInterface | |
   CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
   PIDController | Class implements a PID Control Loop |
 ControllerPower | |
 ControlWord_t | |
 CounterBase | Interface for counting the number of ticks on a digital input channel |
  Counter | Class for counting the number of ticks on a digital input channel |
   GearTooth | Alias for counter class |
  Encoder | Class to read quad encoders |
 CtreCanNode | |
  CanTalonSRX | CAN TALON SRX driver |
  PCM | |
  PDP | |
 llvm::DebugEpochBase | A base class for data structure classes wishing to make iterators ("handles") pointing into themselves fail-fast |
  llvm::DenseMapBase< DenseMap< KeyT, ValueT, KeyInfoT, BucketT >, KeyT, ValueT, KeyInfoT, BucketT > | |
   llvm::DenseMap< KeyT, ValueT, KeyInfoT, BucketT > | |
  llvm::DenseMapBase< DenseMap< std::pair< unsigned int, unsigned int >, SendMsgFunc, DenseMapInfo< std::pair< unsigned int, unsigned int > >, detail::DenseMapPair< std::pair< unsigned int, unsigned int >, SendMsgFunc > >, std::pair< unsigned int, unsigned int >, SendMsgFunc, DenseMapInfo< std::pair< unsigned int, unsigned int > >, detail::DenseMapPair< std::pair< unsigned int, unsigned int >, SendMsgFunc > > | |
   llvm::DenseMap< std::pair< unsigned int, unsigned int >, SendMsgFunc > | |
  llvm::DenseMapBase< DenseMap< std::pair< unsigned int, unsigned int >, std::string, DenseMapInfo< std::pair< unsigned int, unsigned int > >, detail::DenseMapPair< std::pair< unsigned int, unsigned int >, std::string > >, std::pair< unsigned int, unsigned int >, std::string, DenseMapInfo< std::pair< unsigned int, unsigned int > >, detail::DenseMapPair< std::pair< unsigned int, unsigned int >, std::string > > | |
   llvm::DenseMap< std::pair< unsigned int, unsigned int >, std::string > | |
  llvm::DenseMapBase< SmallDenseMap< KeyT, ValueT, InlineBuckets, KeyInfoT, BucketT >, KeyT, ValueT, KeyInfoT, BucketT > | |
   llvm::SmallDenseMap< KeyT, ValueT, InlineBuckets, KeyInfoT, BucketT > | |
  llvm::DenseMapBase< DerivedT, KeyT, ValueT, KeyInfoT, BucketT > | |
 llvm::DenseMapInfo< T > | |
 llvm::DenseMapInfo< char > | |
 llvm::DenseMapInfo< int > | |
 llvm::DenseMapInfo< long > | |
 llvm::DenseMapInfo< long long > | |
 llvm::DenseMapInfo< std::pair< T, U > > | |
 llvm::DenseMapInfo< T * > | |
 llvm::DenseMapInfo< unsigned > | |
 llvm::DenseMapInfo< unsigned long > | |
 llvm::DenseMapInfo< unsigned long long > | |
 nt::DispatcherBase | |
  nt::Dispatcher | |
 nt::EntryInfo | NetworkTables Entry Information |
 Notifier::Thread::EntryListener | |
 Notifier::Thread::EntryNotification | |
 Error | Error object represents a library error |
 ErrorBase | Base class for most objects |
  AxisCamera | Axis M1011 network camera |
  CameraServer | |
  CANJaguar | Luminary Micro / Vex Robotics Jaguar Speed Control |
  CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
  Command | At the very core of the entire command framework |
   CommandGroup | A CommandGroup is a list of commands which are executed in sequence |
   PIDCommand | |
   PrintCommand | |
   StartCommand | |
   WaitCommand | |
   WaitForChildren | |
   WaitUntilCommand | |
  ImageBase | |
   ColorImage | |
    HSLImage | A color image represented in HSL color space at 3 bytes per pixel |
    RGBImage | A color image represented in RGB color space at 3 bytes per pixel |
   MonoImage | |
    BinaryImage | Included for ParticleAnalysisReport definition TODO: Eliminate this dependency! |
  Joystick | Handle input from standard Joysticks connected to the Driver Station |
  MotorSafetyHelper | |
  Notifier | |
  Preferences | The preferences class provides a relatively simple way to save important values to the RoboRIO to access the next time the RoboRIO is booted |
  Resource | Convenient way to track allocated resources |
  RobotDrive | Utility class for handling Robot drive based on a definition of the motor configuration |
  Scheduler | |
  SensorBase | Base class for all sensors |
   AnalogAccelerometer | Handle operation of an analog accelerometer |
   AnalogInput | Analog input class |
   AnalogOutput | MXP analog output class |
   AnalogTrigger | |
   BuiltInAccelerometer | Built-in accelerometer |
   Compressor | PCM compressor |
   Counter | Class for counting the number of ticks on a digital input channel |
   DigitalGlitchFilter | Class to enable glitch filtering on a set of digital inputs |
   DriverStation | Provide access to the network communication data to / from the Driver Station |
   Encoder | Class to read quad encoders |
   GyroBase | GyroBase is the common base class for Gyro implementations such as AnalogGyro |
    ADXRS450_Gyro | Use a rate gyro to return the robots heading relative to a starting position |
    AnalogGyro | Use a rate gyro to return the robots heading relative to a starting position |
   I2C | I2C bus interface class |
    ADXL345_I2C | ADXL345 Accelerometer on I2C |
   InterruptableSensorBase | |
    DigitalSource | DigitalSource Interface |
     AnalogTriggerOutput | Class to represent a specific output from an analog trigger |
     DigitalInput | Class to read a digital input |
     DigitalOutput | Class to write to digital outputs |
   PowerDistributionPanel | Class for getting voltage, current, temperature, power and energy from the CAN PDP |
   PWM | Class implements the PWM generation in the FPGA |
    SafePWM | A safe version of the PWM class |
     Jaguar | Luminary Micro / Vex Robotics Jaguar Speed Controller with PWM control |
     SD540 | Mindsensors SD540 Speed Controller |
     Servo | Standard hobby style servo |
     Spark | REV Robotics Speed Controller |
     Talon | Cross the Road Electronics (CTRE) Talon and Talon SR Speed Controller |
     TalonSRX | Cross the Road Electronics (CTRE) Talon SRX Speed Controller with PWM control |
     Victor | Vex Robotics Victor 888 Speed Controller |
     VictorSP | Vex Robotics Victor SP Speed Controller |
   Relay | Class for Spike style relay outputs |
   SmartDashboard | |
   SolenoidBase | SolenoidBase class is the common base class for the Solenoid and DoubleSolenoid classes |
    DoubleSolenoid | DoubleSolenoid class for running 2 channels of high voltage Digital Output (PCM) |
    Solenoid | Solenoid class for running high voltage Digital Output (PCM) |
   SPI | SPI bus interface class |
    ADXL345_SPI | ADXL345 Accelerometer on SPI |
   Ultrasonic | Ultrasonic rangefinder class |
  SerialPort | Driver for the RS-232 serial port on the RoboRIO |
  Subsystem | |
   PIDSubsystem | 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) |
  Task | Wrapper class around std::thread that allows changing thread priority |
  USBCamera | |
 exception | |
  TableKeyNotDefinedException | An exception thrown when the lookup a a key-value fails in a ITable |
 GenericHID | GenericHID Interface |
  Joystick | Handle input from standard Joysticks connected to the Driver Station |
 Gyro | Interface for yaw rate gyros |
  GyroBase | GyroBase is the common base class for Gyro implementations such as AnalogGyro |
 HALControlWord | |
 HALJoystickAxes | |
 HALJoystickButtons | |
 HALJoystickDescriptor | |
 HALJoystickPOVs | |
 llvm::DebugEpochBase::HandleBase | A base class for iterator classes ("handles") that wish to poll for iterator invalidating modifications in the underlying data structure |
  llvm::DenseMapIterator< KeyT, ValueT, KeyInfoT, Bucket, IsConst > | |
 HasBeenMoved | |
 HLUsageReporting | |
 HLUsageReportingInterface | |
  HardwareHLReporting | |
 IMAQdxAttributeInformation_struct | |
 IMAQdxCameraFile_struct | |
 IMAQdxCameraInformation_struct | |
 IMAQdxEnumItem_struct | |
 llvm::is_integral_or_enum< T > | Metafunction that determines whether the given type is either an integral type or an enumeration type |
 llvm::isPodLike< T > | 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 |
 llvm::isPodLike< ArrayRef< T > > | |
 llvm::isPodLike< std::pair< T, U > > | |
 llvm::isPodLike< StringRef > | |
 ITable | A table whose values can be read and written to |
  NetworkTable | A network table that knows its subtable path |
 ITableListener | A listener that listens to changes in values in a ITable |
  CANJaguar | Luminary Micro / Vex Robotics Jaguar Speed Control |
  CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
  Command | At the very core of the entire command framework |
  Compressor | PCM compressor |
  DigitalOutput | Class to write to digital outputs |
  DoubleSolenoid | DoubleSolenoid class for running 2 channels of high voltage Digital Output (PCM) |
  LiveWindowStatusListener | |
  PIDController | Class implements a PID Control Loop |
  PWM | Class implements the PWM generation in the FPGA |
  Relay | Class for Spike style relay outputs |
  Solenoid | Solenoid class for running high voltage Digital Output (PCM) |
 llvm::iterator_range< IteratorT > | A range adaptor for a pair of iterators |
 JavaByteRef | |
 JavaByteRefBB | |
 JavaGlobal< T > | |
 JavaLocal< T > | |
 JavaStringRef | |
 JavaWeakGlobal< T > | |
 JoystickAxes_t | |
 JoystickPOV_t | |
 llvm::detail::LeadingZerosCounter< T, SizeOfT > | |
 LiveWindow | Public interface for putting sensors and actuators on the LiveWindow |
 LiveWindowComponent | |
 Log | |
 nt::Logger | |
 LoggerThreadJNI::LogMessage | |
 nt::Message | |
 CANTalon::MotionProfileStatus | Motion Profile Status This is simply a data transer object |
 MotorSafety | |
  CANJaguar | Luminary Micro / Vex Robotics Jaguar Speed Control |
  CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
  Relay | Class for Spike style relay outputs |
  RobotDrive | Utility class for handling Robot drive based on a definition of the motor configuration |
  SafePWM | A safe version of the PWM class |
 NetworkAcceptor | |
  TCPAcceptor | |
 nt::NetworkConnection | |
 NetworkStream | |
  TCPStream | |
 nt::Notifier | |
 NT_ConnectionInfo | NetworkTables Connection Information |
 NT_EntryInfo | NetworkTables Entry Information |
 NT_RpcCallInfo | NetworkTables RPC Call Data |
 NT_RpcDefinition | NetworkTables RPC Definition |
 NT_RpcParamDef | NetworkTables RPC Parameter Definition |
 NT_RpcResultDef | NetworkTables RPC Result Definition |
 NT_String | A NetworkTables string |
 NT_Value | NetworkTables Entry Value |
 NullDeleter< T > | |
 pair | |
  llvm::detail::DenseMapPair< std::pair< unsigned int, unsigned int >, SendMsgFunc > | |
  llvm::detail::DenseMapPair< std::pair< unsigned int, unsigned int >, std::string > | |
  llvm::detail::DenseMapPair< KeyT, ValueT > | |
 ParticleAnalysisReport_struct | FrcParticleAnalysis returns this structure |
 PIDOutput | PIDOutput interface is a generic output for the PID class |
  PIDCommand | |
  PIDSubsystem | 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) |
  SpeedController | Interface for speed controlling devices |
   CANSpeedController | Interface for "smart" CAN-based speed controllers |
    CANJaguar | Luminary Micro / Vex Robotics Jaguar Speed Control |
    CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
   Jaguar | Luminary Micro / Vex Robotics Jaguar Speed Controller with PWM control |
   SD540 | Mindsensors SD540 Speed Controller |
   Spark | REV Robotics Speed Controller |
   Talon | Cross the Road Electronics (CTRE) Talon and Talon SR Speed Controller |
   TalonSRX | Cross the Road Electronics (CTRE) Talon SRX Speed Controller with PWM control |
   Victor | Vex Robotics Victor 888 Speed Controller |
   VictorSP | Vex Robotics Victor SP Speed Controller |
 PIDSource | PIDSource interface is a generic sensor source for the PID class |
  AnalogAccelerometer | Handle operation of an analog accelerometer |
  AnalogInput | Analog input class |
  CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
  Encoder | Class to read quad encoders |
  Filter | Interface for filters |
   LinearDigitalFilter | This class implements a linear, digital filter |
  GyroBase | GyroBase is the common base class for Gyro implementations such as AnalogGyro |
  PIDCommand | |
  PIDSubsystem | 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) |
  Potentiometer | Interface for potentiometers |
   AnalogPotentiometer | Class for reading analog potentiometers |
  Ultrasonic | Ultrasonic rangefinder class |
 llvm::PointerLikeTypeTraits< T > | PointerLikeTypeTraits - This is a traits object that is used to handle pointer types and things that are just wrappers for pointers as a uniform entity |
 llvm::PointerLikeTypeTraits< const T * > | |
 llvm::PointerLikeTypeTraits< T * > | |
 llvm::PointerLikeTypeTraits< uintptr_t > | |
 port_t | |
 priority_condition_variable | |
 priority_mutex | |
 priority_recursive_mutex | |
 nt::raw_istream | |
  nt::raw_mem_istream | |
  nt::raw_socket_istream | |
 CtreCanNode::recMsg< T > | |
 CameraServer::Request | |
 hal::Resource | Convenient way to track allocated resources |
 RobotBase | Implement a Robot Program framework |
  IterativeRobot | IterativeRobot implements a specific type of Robot Program framework, extending the RobotBase class |
  SampleRobot | |
 RobotDeleter | This class exists for the sole purpose of getting its destructor called when the module unloads |
 RobotState | |
 RobotStateInterface | |
  DriverStation | Provide access to the network communication data to / from the Driver Station |
 llvm::RoundUpToPowerOfTwo< N > | 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) |
 llvm::RoundUpToPowerOfTwoH< N, isPowerTwo > | RoundUpToPowerOfTwoH - If N is not a power of two, increase it |
 llvm::RoundUpToPowerOfTwoH< N, false > | |
 nt::RpcCallInfo | NetworkTables RPC Call Data |
 nt::RpcDefinition | NetworkTables RPC Definition |
 nt::RpcParamDef | NetworkTables RPC Parameter Definition |
 nt::RpcResultDef | NetworkTables RPC Result Definition |
 nt::RpcServer | |
 nt::SafeThread | |
  LoggerThreadJNI | |
  Notifier::Thread | |
  nt::RpcServer::Thread | |
 nt::detail::SafeThreadOwnerBase | |
  nt::SafeThreadOwner< T > | |
  nt::SafeThreadOwner< LoggerThreadJNI > | |
   LoggerJNI | |
  nt::SafeThreadOwner< RpcServer::Thread > | |
  nt::SafeThreadOwner< Thread > | |
 nt::detail::SafeThreadProxyBase | |
  nt::detail::SafeThreadProxy< T > | |
 Semaphore | |
 Sendable | |
  LiveWindowSendable | Live Window Sendable is a special type of object sendable to the live window |
   ADXL345_I2C | ADXL345 Accelerometer on I2C |
   ADXL345_SPI | ADXL345 Accelerometer on SPI |
   ADXL362 | ADXL362 SPI Accelerometer |
   AnalogAccelerometer | Handle operation of an analog accelerometer |
   AnalogInput | Analog input class |
   AnalogOutput | MXP analog output class |
   AnalogPotentiometer | Class for reading analog potentiometers |
   BuiltInAccelerometer | Built-in accelerometer |
   CANJaguar | Luminary Micro / Vex Robotics Jaguar Speed Control |
   CANTalon | CTRE Talon SRX Speed Controller with CAN Control |
   Compressor | PCM compressor |
   Counter | Class for counting the number of ticks on a digital input channel |
   DigitalInput | Class to read a digital input |
   DigitalOutput | Class to write to digital outputs |
   DoubleSolenoid | DoubleSolenoid class for running 2 channels of high voltage Digital Output (PCM) |
   Encoder | Class to read quad encoders |
   GyroBase | GyroBase is the common base class for Gyro implementations such as AnalogGyro |
   PIDController | Class implements a PID Control Loop |
   PowerDistributionPanel | Class for getting voltage, current, temperature, power and energy from the CAN PDP |
   PWM | Class implements the PWM generation in the FPGA |
   Relay | Class for Spike style relay outputs |
   Solenoid | Solenoid class for running high voltage Digital Output (PCM) |
   Ultrasonic | Ultrasonic rangefinder class |
  NamedSendable | The interface for sendable objects that gives the sendable a default name in the Smart Dashboard |
   Command | At the very core of the entire command framework |
   Scheduler | |
   Subsystem | |
  SendableChooser | The SendableChooser class is a useful tool for presenting a selection of options to the SmartDashboard |
  Trigger | This class provides an easy way to link commands to inputs |
   Button | This class provides an easy way to link commands to OI inputs |
    InternalButton | |
    JoystickButton | |
    NetworkButton | |
 nt::SequenceNumber | |
 llvm::detail::SizerImpl< T1, T2, T3, T4, T5, T6, T7, T8, T9, T10 > | |
 llvm::SmallPtrSetImplBase | SmallPtrSetImplBase - This is the common code shared among all the SmallPtrSet<>'s, which is almost everything |
  llvm::SmallPtrSetImpl< PtrType > | A templated base class for SmallPtrSet which provides the typesafe interface that is common across all small sizes |
   llvm::SmallPtrSet< PtrType, SmallSize > | SmallPtrSet - This class implements a set which is optimized for holding SmallSize or less elements |
 llvm::SmallPtrSetIteratorImpl | SmallPtrSetIteratorImpl - This is the common base class shared between all instances of SmallPtrSetIterator |
  llvm::SmallPtrSetIterator< PtrTy > | SmallPtrSetIterator - This implements a const_iterator for SmallPtrSet |
 llvm::SmallVectorBase | This is all the non-templated stuff common to all SmallVectors |
  llvm::SmallVectorTemplateCommon< T, typename > | This is the part of SmallVectorTemplateBase which does not depend on whether the type T is a POD |
  llvm::SmallVectorTemplateCommon< char > | |
   llvm::SmallVectorTemplateBase< char, isPodLike< char >::value > | |
    llvm::SmallVectorImpl< char > | |
     llvm::SmallVector< char, 256 > | |
     llvm::SmallVector< char, InternalLen > | |
      llvm::SmallString< InternalLen > | SmallString - A SmallString is just a SmallVector with methods and accessors that make it work better as a string (e.g |
  llvm::SmallVectorTemplateCommon< T > | |
   llvm::SmallVectorTemplateBase< T, isPodLike > | SmallVectorTemplateBase<isPodLike = false> - This is where we put method implementations that are designed to work with non-POD-like T's |
   llvm::SmallVectorTemplateBase< T, true > | SmallVectorTemplateBase<isPodLike = true> - This is where we put method implementations that are designed to work with POD-like T's |
   llvm::SmallVectorTemplateBase< T, isPodLike< T >::value > | |
    llvm::SmallVectorImpl< T > | This class consists of common code factored out of the SmallVector class to reduce code duplication based on the SmallVector 'N' template parameter |
     llvm::SmallVector< T, N > | This is a 'vector' (really, a variable-sized array), optimized for the case when the array is small |
 llvm::SmallVectorStorage< T, N > | Storage for the SmallVector elements which aren't contained in SmallVectorTemplateCommon |
 llvm::SmallVectorStorage< char, N > | |
 llvm::SmallVectorStorage< T, 0 > | |
 llvm::SmallVectorStorage< T, 1 > | |
 nt::Storage | |
 llvm::StringMapConstIterator< ValueT > | |
 llvm::StringMapConstIterator< ValueTy > | |
  llvm::StringMapIterator< ValueT > | |
 llvm::StringMapEntryBase | StringMapEntryBase - Shared base class of StringMapEntry instances |
  llvm::StringMapEntry< ValueTy > | StringMapEntry - This is used to represent one value that is inserted into a StringMap |
 llvm::StringMapImpl | StringMapImpl - This is the base class of StringMap that is shared among all of its instantiations |
  llvm::StringMap< ValueTy > | StringMap - This is an unconventional map that is specialized for handling keys that are "strings", which are basically ranges of bytes |
  llvm::StringMap< std::unique_ptr< Entry > > | |
 llvm::StringRef | StringRef - Represent a constant reference to a string, i.e |
 tCANStreamMessage | |
 TCPConnector | |
 Threshold | Color threshold values |
 Timer | Timer objects measure accumulated time in seconds |
 CANTalon::TrajectoryPoint | Motion Profile Trajectory Point This is simply a data transer object |
 CtreCanNode::txTask< T > | |
 nt::Value | NetworkTables Entry Value |
 nt::WireDecoder | |
 nt::WireEncoder | |