Index
All Classes and Interfaces|All Packages|Constant Field Values
A
- ABS_POSITION_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.ArmConstants
- ABS_VELOCITY_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.ArmConstants
- activateShuffleboard() - Method in class frc.robot.shuffleboard.ArmTab
- activateShuffleboard() - Method in class frc.robot.shuffleboard.ClimberTab
- activateShuffleboard() - Method in class frc.robot.shuffleboard.DriverStationTab
- activateShuffleboard() - Method in class frc.robot.shuffleboard.HeadTab
- activateShuffleboard() - Method in class frc.robot.shuffleboard.LEDTab
- activateShuffleboard() - Method in class frc.robot.shuffleboard.MotorTab
-
this method must be called in activateShuffleboard() to add the motors to the shuffleboard in the correct position
- activateShuffleboard() - Method in class frc.robot.shuffleboard.ShuffleboardTabBase
-
This will be called when the tab is added to shuffleboard.
- activateShuffleboard() - Method in class frc.robot.shuffleboard.SwerveTab
- activateTabs() - Method in class frc.robot.shuffleboard.ShuffleboardInfo
- addMotor(CANSparkMax[]) - Method in class frc.robot.shuffleboard.MotorTab
-
This method is used to add a motor to the MotorTab
- addTabs(ArrayList<ShuffleboardTabBase>) - Method in class frc.robot.shuffleboard.ShuffleboardInfo
- aimAtSpeaker(Supplier<Double>, Supplier<Double>) - Method in class frc.robot.RobotContainer
- AimAtTag - Class in frc.robot.commands.drivetrain
- AimAtTag(Drivetrain, int, boolean, Supplier<Double>, Supplier<Double>) - Constructor for class frc.robot.commands.drivetrain.AimAtTag
- AimAtTag(Drivetrain, int, Supplier<Double>, Supplier<Double>) - Constructor for class frc.robot.commands.drivetrain.AimAtTag
- Alert - Class in frc.robot.util
-
Class for managing persistent alerts to be sent over NetworkTables.
- Alert(String, Alert.AlertType) - Constructor for class frc.robot.util.Alert
-
Creates a new Alert in the default group - "Alerts".
- Alert(String, String, Alert.AlertType) - Constructor for class frc.robot.util.Alert
-
Creates a new Alert.
- Alert.AlertType - Enum Class in frc.robot.util
-
Represents an alert's level of urgency.
- ALIGMNMENT_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
- ambiguity - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
- AMP - Enum constant in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
- areArmAndElevatorAtTarget() - Method in class frc.robot.subsystems.Arm
- Arm - Class in frc.robot.subsystems
- Arm() - Constructor for class frc.robot.subsystems.Arm
-
Creates a new Arm.
- arm_angle() - Method in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
- ARM_AT_TARGET_DEADBAND - Static variable in class frc.robot.Constants.ArmConstants
- ARM_OFFSET - Static variable in class frc.robot.Constants.ArmConstants
- ARM_VELOCITY_DEADBAND - Static variable in class frc.robot.Constants.ArmConstants
- ArmConstants() - Constructor for class frc.robot.Constants.ArmConstants
- ArmDefaultCommand(Supplier<Double>, Supplier<Double>) - Method in class frc.robot.subsystems.Arm
- ArmTab - Class in frc.robot.shuffleboard
- ArmTab(Arm) - Constructor for class frc.robot.shuffleboard.ArmTab
- AUTO_SHOOT_SPEED - Static variable in class frc.robot.Constants.ShootingConstants
- autoChooser - Variable in class frc.robot.RobotContainer
- AutoConstants() - Constructor for class frc.robot.Constants.AutoConstants
- autonomousInit() - Method in class frc.robot.Robot
-
This autonomous runs the autonomous command selected by your
RobotContainer
class. - autonomousPeriodic() - Method in class frc.robot.Robot
-
This function is called periodically during autonomous.
- AutonomousPrepareShoot(Arm, Head, Supplier<Double>) - Static method in class frc.robot.commands.MechanismCommands
- AutonomousShoot(Arm, Head, Constants.ShootingConstants.ShootingPosition) - Static method in class frc.robot.commands.MechanismCommands
- AutonomousShoot(Arm, Head, Drivetrain) - Static method in class frc.robot.commands.MechanismCommands
- AutoStowAndStopIntake(Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
- avgTagArea - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- avgTagDist - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
B
- BALANCE_KD - Static variable in class frc.robot.Constants.ClimberConstants
- BALANCE_KI - Static variable in class frc.robot.Constants.ClimberConstants
- BALANCE_KP - Static variable in class frc.robot.Constants.ClimberConstants
- botpose - Variable in class frc.robot.util.LimelightHelpers.Results
- botpose_avgarea - Variable in class frc.robot.util.LimelightHelpers.Results
- botpose_avgdist - Variable in class frc.robot.util.LimelightHelpers.Results
- botpose_span - Variable in class frc.robot.util.LimelightHelpers.Results
- botpose_tagcount - Variable in class frc.robot.util.LimelightHelpers.Results
- botpose_wpiblue - Variable in class frc.robot.util.LimelightHelpers.Results
- botpose_wpired - Variable in class frc.robot.util.LimelightHelpers.Results
- BOTTOM_kD - Static variable in class frc.robot.Constants.ShooterConstants
- BOTTOM_kF - Static variable in class frc.robot.Constants.ShooterConstants
- BOTTOM_kI - Static variable in class frc.robot.Constants.ShooterConstants
- BOTTOM_kMaxOutput - Static variable in class frc.robot.Constants.ShooterConstants
- BOTTOM_kMinOutput - Static variable in class frc.robot.Constants.ShooterConstants
- BOTTOM_kP - Static variable in class frc.robot.Constants.ShooterConstants
- BRAKE_TIMER_DURATION - Static variable in class frc.robot.Constants.SwerveConstants
-
Time to brake the chassis for after the robot is disabled, in seconds
- BRAKE_TOGGLE_BUTTON_DIO - Static variable in class frc.robot.Constants
C
- camerapose_robotspace - Variable in class frc.robot.util.LimelightHelpers.Results
- classID - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- classID - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- className - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- className - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- CLIMB_HEIGHT - Static variable in class frc.robot.Constants.ClimberConstants
- CLIMB_RATE - Static variable in class frc.robot.Constants.ClimberConstants
- Climber - Class in frc.robot.subsystems
- Climber() - Constructor for class frc.robot.subsystems.Climber
-
Creates a new Climber.
- ClimberConstants() - Constructor for class frc.robot.Constants.ClimberConstants
- ClimberTab - Class in frc.robot.shuffleboard
- ClimberTab(Climber) - Constructor for class frc.robot.shuffleboard.ClimberTab
- confidence - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- confidence - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- Constants - Class in frc.robot
-
The Constants class provides a convenient place for teams to hold robot-wide numerical or boolean constants.
- Constants() - Constructor for class frc.robot.Constants
- Constants.ArmConstants - Class in frc.robot
- Constants.AutoConstants - Class in frc.robot
- Constants.ClimberConstants - Class in frc.robot
- Constants.ElevatorConstants - Class in frc.robot
- Constants.IntakeConstants - Class in frc.robot
- Constants.OperatorConstants - Class in frc.robot
- Constants.ShooterConstants - Class in frc.robot
- Constants.ShootingConstants - Class in frc.robot
- Constants.ShootingConstants.ShootingPosition - Enum Class in frc.robot
- Constants.SwerveConstants - Class in frc.robot
- Constants.VisionConstants - Class in frc.robot
D
- DBOT - Enum constant in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
- DISABLED_BATTERY_WARNING_VOLTAGE - Static variable in class frc.robot.Constants
- disabledInit() - Method in class frc.robot.Robot
-
This function is called once each time the robot enters Disabled mode.
- disabledPeriodic() - Method in class frc.robot.Robot
- distToCamera - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
- distToRobot - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
- doVisionUpdates(boolean) - Method in class frc.robot.RobotContainer
- doVisionUpdates(boolean) - Method in class frc.robot.subsystems.Drivetrain
- drive(Translation2d, double, boolean) - Method in class frc.robot.subsystems.Drivetrain
-
The primary method for controlling the drivebase.
- drive(ChassisSpeeds) - Method in class frc.robot.subsystems.Drivetrain
-
Drive according to the chassis robot oriented velocity.
- DRIVEBASE - Static variable in class frc.robot.Constants.SwerveConstants
-
The total mass of the drivetrain, eboard, and associated components.
- driveCommand(DoubleSupplier, DoubleSupplier, DoubleSupplier) - Method in class frc.robot.subsystems.Drivetrain
-
Command to drive the robot using translative values and heading as angular velocity.
- driveCommand(DoubleSupplier, DoubleSupplier, DoubleSupplier, DoubleSupplier) - Method in class frc.robot.subsystems.Drivetrain
-
Command to drive the robot using translative values and heading as a setpoint.
- driveFieldOriented(ChassisSpeeds) - Method in class frc.robot.subsystems.Drivetrain
-
Drive the robot given a chassis field oriented velocity.
- DRIVER_CONTROLLER_PORT - Static variable in class frc.robot.Constants.OperatorConstants
- DRIVER_JOYSTICK_DEADBAND - Static variable in class frc.robot.Constants.OperatorConstants
- DriverStationTab - Class in frc.robot.shuffleboard
-
Add your docs here.
- DriverStationTab(SendableChooser<Command>, DigitalInput) - Constructor for class frc.robot.shuffleboard.DriverStationTab
- driveToPose(Pose2d) - Method in class frc.robot.subsystems.Drivetrain
- Drivetrain - Class in frc.robot.subsystems
- Drivetrain() - Constructor for class frc.robot.subsystems.Drivetrain
-
Initialize
SwerveDrive
with the directory provided.
E
- ELEVATOR_AT_TARGET_DEADBAND - Static variable in class frc.robot.Constants.ElevatorConstants
- elevator_target() - Method in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
- ElevatorConstants() - Constructor for class frc.robot.Constants.ElevatorConstants
- EnableBrakeMode() - Method in class frc.robot.subsystems.Arm
- EnableBrakeMode() - Method in class frc.robot.subsystems.Head
- ENABLED_BATTERY_WARNING_VOLTAGE - Static variable in class frc.robot.Constants
- end(boolean) - Method in class frc.robot.commands.drivetrain.AimAtTag
- end(boolean) - Method in class frc.robot.commands.drivetrain.LockWheelsState
- end(boolean) - Method in class frc.robot.commands.drivetrain.TurnToTag
- error - Variable in class frc.robot.util.LimelightHelpers.LimelightResults
- ERROR - Enum constant in enum class frc.robot.util.Alert.AlertType
-
High priority alert - displayed first on the dashboard with a red "X" symbol.
- execute() - Method in class frc.robot.commands.drivetrain.AimAtTag
- execute() - Method in class frc.robot.commands.drivetrain.LockWheelsState
- execute() - Method in class frc.robot.commands.drivetrain.TurnToTag
- EXTENDED_KG - Static variable in class frc.robot.Constants.ArmConstants
- EXTENDED_KS - Static variable in class frc.robot.Constants.ArmConstants
- EXTENDED_KV - Static variable in class frc.robot.Constants.ArmConstants
F
- FAST_SPEED_INCREMENT - Static variable in class frc.robot.Constants.SwerveConstants
- FAST_TURN_TIME - Static variable in class frc.robot.Constants.SwerveConstants
- FEEDER_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
- fiducialFamily - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- fiducialID - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- FLOOR_PICKUP - Static variable in class frc.robot.Constants.ArmConstants
- frc.robot - package frc.robot
- frc.robot.commands - package frc.robot.commands
- frc.robot.commands.drivetrain - package frc.robot.commands.drivetrain
- frc.robot.shuffleboard - package frc.robot.shuffleboard
- frc.robot.subsystems - package frc.robot.subsystems
- frc.robot.util - package frc.robot.util
G
- getArmAbsoluteEncoderPosition() - Method in class frc.robot.subsystems.Arm
- getAutonomousCommand() - Method in class frc.robot.RobotContainer
-
Use this to pass the autonomous command to the main
Robot
class. - getAutonomousCommand(String, boolean) - Method in class frc.robot.subsystems.Drivetrain
-
Get the path follower with events.
- getBotpose(String) - Static method in class frc.robot.util.LimelightHelpers
-
Deprecated.
- getBotPose(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotPose_TargetSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotpose_wpiBlue(String) - Static method in class frc.robot.util.LimelightHelpers
-
Deprecated.
- getBotPose_wpiBlue(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotpose_wpiRed(String) - Static method in class frc.robot.util.LimelightHelpers
-
Deprecated.
- getBotPose_wpiRed(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotPose2d() - Method in class frc.robot.util.LimelightHelpers.Results
- getBotPose2d(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d for easy use with Odometry vision pose estimator (addVisionMeasurement)
- getBotPose2d_wpiBlue() - Method in class frc.robot.util.LimelightHelpers.Results
- getBotPose2d_wpiBlue(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d for easy use with Odometry vision pose estimator (addVisionMeasurement)
- getBotPose2d_wpiRed() - Method in class frc.robot.util.LimelightHelpers.Results
- getBotPose2d_wpiRed(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d for easy use with Odometry vision pose estimator (addVisionMeasurement)
- getBotPose3d() - Method in class frc.robot.util.LimelightHelpers.Results
- getBotPose3d(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotPose3d_TargetSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotPose3d_wpiBlue() - Method in class frc.robot.util.LimelightHelpers.Results
- getBotPose3d_wpiBlue(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotPose3d_wpiRed() - Method in class frc.robot.util.LimelightHelpers.Results
- getBotPose3d_wpiRed(String) - Static method in class frc.robot.util.LimelightHelpers
- getBotPoseEstimate_wpiBlue(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d and timestamp for use with WPILib pose estimator (addVisionMeasurement) when you are on the BLUE alliance
- getBotPoseEstimate_wpiBlue_MegaTag2(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d and timestamp for use with WPILib pose estimator (addVisionMeasurement) when you are on the BLUE alliance
- getBotPoseEstimate_wpiRed(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d and timestamp for use with WPILib pose estimator (addVisionMeasurement) when you are on the RED alliance
- getBotPoseEstimate_wpiRed_MegaTag2(String) - Static method in class frc.robot.util.LimelightHelpers
-
Gets the Pose2d and timestamp for use with WPILib pose estimator (addVisionMeasurement) when you are on the RED alliance
- getCameraPose_TargetSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getCameraPose_TargetSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getCameraPose_TargetSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getCameraPose_TargetSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getCameraPose_TargetSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getCameraPose3d_RobotSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getCameraPose3d_TargetSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getCurrentPipelineIndex(String) - Static method in class frc.robot.util.LimelightHelpers
- getDistanceToSpeaker() - Method in class frc.robot.subsystems.Drivetrain
- getElevatorAbsoluteEncoderPosition() - Method in class frc.robot.subsystems.Arm
- getFiducialID(String) - Static method in class frc.robot.util.LimelightHelpers
- getFieldVelocity() - Method in class frc.robot.subsystems.Drivetrain
-
Gets the current field-relative velocity (x, y and omega) of the robot
- getHeading() - Method in class frc.robot.subsystems.Drivetrain
-
Gets the current yaw angle of the robot, as reported by the imu.
- getInstance() - Static method in class frc.robot.shuffleboard.ShuffleboardInfo
- getJSONDump(String) - Static method in class frc.robot.util.LimelightHelpers
- getKinematics() - Method in class frc.robot.subsystems.Drivetrain
-
Get the swerve drive kinematics object.
- getLatency_Capture(String) - Static method in class frc.robot.util.LimelightHelpers
- getLatency_Pipeline(String) - Static method in class frc.robot.util.LimelightHelpers
- getLatestResults(String) - Static method in class frc.robot.util.LimelightHelpers
-
Parses Limelight's JSON results dump into a LimelightResults Object
- getLimelightNTDouble(String, String) - Static method in class frc.robot.util.LimelightHelpers
- getLimelightNTDoubleArray(String, String) - Static method in class frc.robot.util.LimelightHelpers
- getLimelightNTString(String, String) - Static method in class frc.robot.util.LimelightHelpers
- getLimelightNTTable(String) - Static method in class frc.robot.util.LimelightHelpers
- getLimelightNTTableEntry(String, String) - Static method in class frc.robot.util.LimelightHelpers
- getLimelightURLString(String, String) - Static method in class frc.robot.util.LimelightHelpers
- getMaximumVelocity() - Method in class frc.robot.subsystems.Drivetrain
- getMotors() - Method in class frc.robot.subsystems.Climber
- getMotorTab() - Method in class frc.robot.subsystems.Arm
- getNetworkTable() - Method in class frc.robot.shuffleboard.ArmTab
- getNetworkTable() - Method in class frc.robot.shuffleboard.ClimberTab
- getNetworkTable() - Method in class frc.robot.shuffleboard.DriverStationTab
- getNetworkTable() - Method in class frc.robot.shuffleboard.HeadTab
- getNetworkTable() - Method in class frc.robot.shuffleboard.LEDTab
- getNetworkTable() - Method in class frc.robot.shuffleboard.ShuffleboardTabBase
-
return the name of the network table being pushed to (not including the logging/)
- getNetworkTable() - Method in class frc.robot.shuffleboard.SwerveTab
- getNeuralClassID(String) - Static method in class frc.robot.util.LimelightHelpers
- getPitch() - Method in class frc.robot.subsystems.Drivetrain
-
Gets the current pitch angle of the robot, as reported by the imu.
- getPose() - Method in class frc.robot.subsystems.Drivetrain
-
Gets the current pose (position and rotation) of the robot, as reported by odometry.
- getPositionLeftMotor() - Method in class frc.robot.subsystems.Climber
- getPositionRightMotor() - Method in class frc.robot.subsystems.Climber
- getPythonScriptData(String) - Static method in class frc.robot.util.LimelightHelpers
- getRobotPose_FieldSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getRobotPose_FieldSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getRobotPose_FieldSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getRobotPose_FieldSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getRobotPose_TargetSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getRobotPose_TargetSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getRobotPose_TargetSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getRobotPose_TargetSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getRobotVelocity() - Method in class frc.robot.subsystems.Drivetrain
-
Gets the current velocity (x, y and omega) of the robot
- getRoll() - Method in class frc.robot.subsystems.Drivetrain
-
Gets the current roll angle of the robot, as reported by the imu.
- getShooterBottomSpeed() - Method in class frc.robot.subsystems.Head
- getShooterSetPoint() - Method in class frc.robot.subsystems.Head
- getShooterTopSpeed() - Method in class frc.robot.subsystems.Head
- getSpeedLeft() - Method in class frc.robot.subsystems.Climber
- getSpeedRight() - Method in class frc.robot.subsystems.Climber
- getSwerveController() - Method in class frc.robot.subsystems.Drivetrain
-
Get the
SwerveController
in the swerve drive. - getSwerveDriveConfiguration() - Method in class frc.robot.subsystems.Drivetrain
-
Get the
SwerveDriveConfiguration
object. - getTA(String) - Static method in class frc.robot.util.LimelightHelpers
- getTargetColor(String) - Static method in class frc.robot.util.LimelightHelpers
- getTargetPose_CameraSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getTargetPose_CameraSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getTargetPose_CameraSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getTargetPose_CameraSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getTargetPose_CameraSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getTargetPose_RobotSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getTargetPose_RobotSpace() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getTargetPose_RobotSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getTargetPose_RobotSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- getTargetPose_RobotSpace2D() - Method in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- getTargetPose3d_CameraSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getTargetPose3d_RobotSpace(String) - Static method in class frc.robot.util.LimelightHelpers
- getTargetSpeeds(double, double, double) - Method in class frc.robot.subsystems.Drivetrain
- getTargetSpeeds(double, double, double, double) - Method in class frc.robot.subsystems.Drivetrain
-
Get the chassis speeds based on controller input of 2 joysticks.
- getTargetSpeeds(double, double, Rotation2d) - Method in class frc.robot.subsystems.Drivetrain
-
Get the chassis speeds based on controller input of 1 joystick and one angle.
- getTV(String) - Static method in class frc.robot.util.LimelightHelpers
- getTX(String) - Static method in class frc.robot.util.LimelightHelpers
- getTY(String) - Static method in class frc.robot.util.LimelightHelpers
H
- HapticCommands - Class in frc.robot.commands
- HapticCommands() - Constructor for class frc.robot.commands.HapticCommands
- HapticTap(XboxController, GenericHID.RumbleType, double, double) - Static method in class frc.robot.commands.HapticCommands
-
Trigger rumble on a controller for a specified amount of time.
- Head - Class in frc.robot.subsystems
- Head() - Constructor for class frc.robot.subsystems.Head
-
Creates a new Head.
- HeadTab - Class in frc.robot.shuffleboard
- HeadTab(Head) - Constructor for class frc.robot.shuffleboard.HeadTab
I
- id - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
- INFO - Enum constant in enum class frc.robot.util.Alert.AlertType
-
Low priority alert - displayed last on the dashboard with a green "i" symbol.
- initialize() - Method in class frc.robot.commands.drivetrain.AimAtTag
- initialize() - Method in class frc.robot.commands.drivetrain.LockWheelsState
- initialize() - Method in class frc.robot.commands.drivetrain.TurnToTag
- INTAKE_CAMERA_POSITION - Static variable in class frc.robot.Constants.VisionConstants
- INTAKE_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
- IntakeConstants() - Constructor for class frc.robot.Constants.IntakeConstants
- IntakeGround(XboxController, XboxController, Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
-
will finish after piece has been intaken
- IntakeGround(Arm, Head, boolean) - Static method in class frc.robot.commands.MechanismCommands
-
will finish after piece has been intaken
- IntakePiece() - Method in class frc.robot.subsystems.Head
- IntakeSource(XboxController, XboxController, Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
-
will finish after piece has been intaken
- IntakeSource(Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
-
will finish after piece has been intaken
- isFinished() - Method in class frc.robot.commands.drivetrain.AimAtTag
- isFinished() - Method in class frc.robot.commands.drivetrain.LockWheelsState
- isFinished() - Method in class frc.robot.commands.drivetrain.TurnToTag
- isNoteWithinAlignmentSensor() - Method in class frc.robot.subsystems.Head
- isNoteWithinSensor() - Method in class frc.robot.subsystems.Head
- isReadyToShoot() - Method in class frc.robot.subsystems.Head
K
- KD - Static variable in class frc.robot.Constants.ArmConstants
- KD - Static variable in class frc.robot.Constants.ElevatorConstants
- KG - Static variable in class frc.robot.Constants.ElevatorConstants
- KI - Static variable in class frc.robot.Constants.ArmConstants
- KI - Static variable in class frc.robot.Constants.ElevatorConstants
- KILL_IT_ALL - Static variable in class frc.robot.Constants.ElevatorConstants
- kMaxOutput - Static variable in class frc.robot.Constants.ArmConstants
- kMaxOutput - Static variable in class frc.robot.Constants.ElevatorConstants
- kMinOutput - Static variable in class frc.robot.Constants.ArmConstants
- kMinOutput - Static variable in class frc.robot.Constants.ElevatorConstants
- KP - Static variable in class frc.robot.Constants.ArmConstants
- KP - Static variable in class frc.robot.Constants.ElevatorConstants
- KS - Static variable in class frc.robot.Constants.ElevatorConstants
- KV - Static variable in class frc.robot.Constants.ElevatorConstants
L
- latency - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- latency_capture - Variable in class frc.robot.util.LimelightHelpers.Results
- latency_jsonParse - Variable in class frc.robot.util.LimelightHelpers.Results
- latency_pipeline - Variable in class frc.robot.util.LimelightHelpers.Results
- LED - Class in frc.robot.subsystems
- LED(SerialPort.Port, Head) - Constructor for class frc.robot.subsystems.LED
- LEDTab - Class in frc.robot.shuffleboard
- LEDTab(LED) - Constructor for class frc.robot.shuffleboard.LEDTab
- LEFT_CLIMBER_PORT - Static variable in class frc.robot.Constants.ClimberConstants
- LEFT_MOTOR_ID - Static variable in class frc.robot.Constants.ArmConstants
- LEFT_MOTOR_ID - Static variable in class frc.robot.Constants.ElevatorConstants
- LimelightHelpers - Class in frc.robot.util
- LimelightHelpers() - Constructor for class frc.robot.util.LimelightHelpers
- LimelightHelpers.LimelightResults - Class in frc.robot.util
- LimelightHelpers.LimelightTarget_Barcode - Class in frc.robot.util
- LimelightHelpers.LimelightTarget_Classifier - Class in frc.robot.util
- LimelightHelpers.LimelightTarget_Detector - Class in frc.robot.util
- LimelightHelpers.LimelightTarget_Fiducial - Class in frc.robot.util
- LimelightHelpers.LimelightTarget_Retro - Class in frc.robot.util
- LimelightHelpers.PoseEstimate - Class in frc.robot.util
- LimelightHelpers.RawFiducial - Class in frc.robot.util
- LimelightHelpers.Results - Class in frc.robot.util
- LimelightResults() - Constructor for class frc.robot.util.LimelightHelpers.LimelightResults
- LimelightTarget_Barcode() - Constructor for class frc.robot.util.LimelightHelpers.LimelightTarget_Barcode
- LimelightTarget_Classifier() - Constructor for class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- LimelightTarget_Detector() - Constructor for class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- LimelightTarget_Fiducial() - Constructor for class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- LimelightTarget_Retro() - Constructor for class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- LINEAR_AUTO_KD - Static variable in class frc.robot.Constants.AutoConstants
- LINEAR_AUTO_KI - Static variable in class frc.robot.Constants.AutoConstants
- LINEAR_AUTO_KP - Static variable in class frc.robot.Constants.AutoConstants
- lock() - Method in class frc.robot.subsystems.Drivetrain
-
Lock the swerve drive to prevent it from moving.
- LockWheelsState - Class in frc.robot.commands.drivetrain
-
A state that locks the wheels of the swerve drive to force it to remain stationary
- LockWheelsState(Drivetrain) - Constructor for class frc.robot.commands.drivetrain.LockWheelsState
- LOOP_TIME - Static variable in class frc.robot.Constants.SwerveConstants
-
This is the time it takes for the PID to update in seconds, 20ms + 110ms sprk max velocity lag
- lowerElevator() - Method in class frc.robot.subsystems.Arm
M
- main(String...) - Static method in class frc.robot.Main
-
Main initialization function.
- Main - Class in frc.robot
-
Do NOT add any static variables to this class, or any initialization at all.
- MAX_AMPERAGE - Static variable in class frc.robot.Constants.ArmConstants
- MAX_AMPERAGE - Static variable in class frc.robot.Constants.ElevatorConstants
- MAX_ANGLE - Static variable in class frc.robot.Constants.ArmConstants
- MAX_DETECTION_RANGE - Static variable in class frc.robot.Constants.VisionConstants
- MAX_ENCODER_VALUE - Static variable in class frc.robot.Constants.ClimberConstants
- MAX_HEIGHT - Static variable in class frc.robot.Constants.ElevatorConstants
-
the maximum height the elevator can safely reach
- MAX_MANNUAL_ARM_SPEED - Static variable in class frc.robot.Constants.ArmConstants
- MAX_MANUAL_SPEED - Static variable in class frc.robot.Constants.ElevatorConstants
-
the maximum height the elevator can be, but still be safely inside the bumber of the robot
- MAX_MODULE_SPEED - Static variable in class frc.robot.Constants.AutoConstants
- MAX_VELOCITY_METER_PER_SEC - Static variable in class frc.robot.Constants.SwerveConstants
- MechanismCommands - Class in frc.robot.commands
- MechanismCommands() - Constructor for class frc.robot.commands.MechanismCommands
- MIN_ABOVE_PASS_ANGLE - Static variable in class frc.robot.Constants.ArmConstants
-
the mininum angle the arm can be where the elevator can pass over the bumper
- MIN_ABOVE_PASS_HEIGHT - Static variable in class frc.robot.Constants.ElevatorConstants
-
the mininum height the elevator can be to safely reach over the bumper of the robot
- MIN_ANGLE - Static variable in class frc.robot.Constants.ArmConstants
- MIN_HEIGHT - Static variable in class frc.robot.Constants.ElevatorConstants
-
the mininum height the elevator reaches when its retracted
- MOTOR_BOTTOM_CAN_ID - Static variable in class frc.robot.Constants.ShooterConstants
- MOTOR_CAN_ID - Static variable in class frc.robot.Constants.IntakeConstants
- MOTOR_TOP_CAN_ID - Static variable in class frc.robot.Constants.ShooterConstants
- MotorTab - Class in frc.robot.shuffleboard
-
This class is used to create a tab on the shuffleboard that displays information about the motor power and current
- MotorTab(int, String) - Constructor for class frc.robot.shuffleboard.MotorTab
-
This constructor is used to create a MotorTab, periodic() must be called in the subsystem's periodic method
- MotorTab(int, String, int) - Constructor for class frc.robot.shuffleboard.MotorTab
-
This constructor is used to create a MotorTab, periodic() must be called in the subsystem's periodic method
N
- NOTE_ALIGNMENT_SENSOR_DIO - Static variable in class frc.robot.Constants.IntakeConstants
- NOTE_SENSOR_DIO - Static variable in class frc.robot.Constants.IntakeConstants
- NUMBER_OF_MOTORS - Static variable in class frc.robot.Constants
O
- OPERATOR_CONTROLLER_PORT - Static variable in class frc.robot.Constants.OperatorConstants
- OPERATOR_JOYSTICK_DEADBAND - Static variable in class frc.robot.Constants.OperatorConstants
- OperatorConstants() - Constructor for class frc.robot.Constants.OperatorConstants
- OUTAKE_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
- OutakePiece() - Method in class frc.robot.subsystems.Head
- outputValues(Supplier<Double>, Supplier<Double>) - Method in class frc.robot.RobotContainer
P
- periodic() - Method in class frc.robot.shuffleboard.ShuffleboardInfo
- periodic() - Method in class frc.robot.subsystems.Arm
- periodic() - Method in class frc.robot.subsystems.Climber
- periodic() - Method in class frc.robot.subsystems.Drivetrain
- periodic() - Method in class frc.robot.subsystems.Head
- periodic() - Method in class frc.robot.subsystems.LED
- pipelineID - Variable in class frc.robot.util.LimelightHelpers.Results
- PODIUM - Enum constant in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
- PODIUM_DISTANCE - Static variable in class frc.robot.Constants
-
in meters
- pointAwayFromSpeaker() - Method in class frc.robot.RobotContainer
-
DOES NOT ACTAULLY TURN TO ZERO BE AWARE
- pose - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- PoseEstimate(Pose2d, double, double, int, double, double, double, LimelightHelpers.RawFiducial[]) - Constructor for class frc.robot.util.LimelightHelpers.PoseEstimate
- postTrajectory(Trajectory) - Method in class frc.robot.subsystems.Drivetrain
-
Post the trajectory to the field.
- PRECISE_INCREMENT - Static variable in class frc.robot.Constants.SwerveConstants
- PrepareShoot(XboxController, Arm, Head, Constants.ShootingConstants.ShootingPosition) - Static method in class frc.robot.commands.MechanismCommands
-
will finish when ready
- PrepareShoot(XboxController, Arm, Head, Supplier<Double>) - Static method in class frc.robot.commands.MechanismCommands
-
will finish when ready
- PrepareShoot(Arm, Head, Constants.ShootingConstants.ShootingPosition) - Static method in class frc.robot.commands.MechanismCommands
-
will finish when ready
- PrepareShoot(Arm, Head, Supplier<Double>) - Static method in class frc.robot.commands.MechanismCommands
-
will finish when ready
R
- RaiseElevator() - Method in class frc.robot.subsystems.Arm
- RawFiducial(int, double, double, double, double, double, double) - Constructor for class frc.robot.util.LimelightHelpers.RawFiducial
- rawFiducials - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- REGULAR_SPEED - Static variable in class frc.robot.Constants.SwerveConstants
- resetLastAngeScalar() - Method in class frc.robot.subsystems.Drivetrain
- resetOdometry(Pose2d) - Method in class frc.robot.subsystems.Drivetrain
-
Resets odometry to the given pose.
- resetPose(Pose2d) - Method in class frc.robot.subsystems.Drivetrain
- Results() - Constructor for class frc.robot.util.LimelightHelpers.Results
- RETRACTED_KG - Static variable in class frc.robot.Constants.ArmConstants
- RETRACTED_KS - Static variable in class frc.robot.Constants.ArmConstants
- RETRACTED_KV - Static variable in class frc.robot.Constants.ArmConstants
- RIGHT_CLIMBER_PORT - Static variable in class frc.robot.Constants.ClimberConstants
- RIGHT_MOTOR_ID - Static variable in class frc.robot.Constants.ArmConstants
- RIGHT_MOTOR_ID - Static variable in class frc.robot.Constants.ElevatorConstants
- Robot - Class in frc.robot
-
The VM is configured to automatically run this class, and to call the functions corresponding to each mode, as described in the TimedRobot documentation.
- Robot() - Constructor for class frc.robot.Robot
- ROBOT_MASS - Static variable in class frc.robot.Constants.SwerveConstants
-
The total mass of the robot, in kilograms.
- RobotContainer - Class in frc.robot
-
This class is where the bulk of the robot should be declared.
- RobotContainer() - Constructor for class frc.robot.RobotContainer
-
The container for the robot.
- robotInit() - Method in class frc.robot.Robot
-
This function is run when the robot is first started up and should be used for any initialization code.
- robotPeriodic() - Method in class frc.robot.Robot
-
This function is called every 20 ms, no matter the mode.
- ROTATION_RATE - Static variable in class frc.robot.Constants.OperatorConstants
- rpm() - Method in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
S
- set(boolean) - Method in class frc.robot.util.Alert
-
Sets whether the alert should currently be displayed.
- setArmTarget(double) - Method in class frc.robot.subsystems.Arm
-
safely set the target angle for the arm
- setArmTargetByDistanceExtended(double) - Method in class frc.robot.subsystems.Arm
-
sets the arm target based on the distance to the speaker and the interpolation table
- setArmTargetByDistanceRetracted(double) - Method in class frc.robot.subsystems.Arm
- setArmVelocity(double) - Method in class frc.robot.subsystems.Arm
-
sets the velocity for the arm by moving a position setpoint
- setAutoDisabledAnimation() - Method in class frc.robot.subsystems.LED
- setAutoEnabledAnimation() - Method in class frc.robot.subsystems.LED
- setCameraMode_Driver(String) - Static method in class frc.robot.util.LimelightHelpers
- setCameraMode_Processor(String) - Static method in class frc.robot.util.LimelightHelpers
- setCameraPose_RobotSpace(String, double, double, double, double, double, double) - Static method in class frc.robot.util.LimelightHelpers
- setChassisSpeeds(ChassisSpeeds) - Method in class frc.robot.subsystems.Drivetrain
-
Set chassis speeds with closed-loop velocity control.
- setCropWindow(String, double, double, double, double) - Static method in class frc.robot.util.LimelightHelpers
-
Sets the crop window.
- setDisconnectedAnimation() - Method in class frc.robot.subsystems.LED
- setElevatorTarget(double) - Method in class frc.robot.subsystems.Arm
-
safely set the target height for the elevator
- setElevatorVelocity(double) - Method in class frc.robot.subsystems.Arm
-
sets the velocity for the elevator by moving a position setpoint
- setEStopAnimation() - Method in class frc.robot.subsystems.LED
- SetFiducialIDFiltersOverride(String, int[]) - Static method in class frc.robot.util.LimelightHelpers
- setHeadingCorrection(boolean) - Method in class frc.robot.subsystems.Drivetrain
- setHoldingNoteAnimation() - Method in class frc.robot.subsystems.LED
- setLEDMode_ForceBlink(String) - Static method in class frc.robot.util.LimelightHelpers
- setLEDMode_ForceOff(String) - Static method in class frc.robot.util.LimelightHelpers
- setLEDMode_ForceOn(String) - Static method in class frc.robot.util.LimelightHelpers
- setLEDMode_PipelineControl(String) - Static method in class frc.robot.util.LimelightHelpers
-
The LEDs will be controlled by Limelight pipeline settings, and not by robot code.
- setLimelightNTDouble(String, String, double) - Static method in class frc.robot.util.LimelightHelpers
- setLimelightNTDoubleArray(String, String, double[]) - Static method in class frc.robot.util.LimelightHelpers
- setMotorBrake(boolean) - Method in class frc.robot.RobotContainer
- setMotorBrake(boolean) - Method in class frc.robot.subsystems.Drivetrain
-
Sets the drive motors to brake/coast mode.
- setPipelineIndex(String, int) - Static method in class frc.robot.util.LimelightHelpers
- setPriorityTagID(String, int) - Static method in class frc.robot.util.LimelightHelpers
- setPythonScriptData(String, double[]) - Static method in class frc.robot.util.LimelightHelpers
- setReadyToShootAnimation() - Method in class frc.robot.subsystems.LED
- SetRobotOrientation(String, double, double, double, double, double, double) - Static method in class frc.robot.util.LimelightHelpers
- setSpeed(double, double) - Method in class frc.robot.subsystems.Climber
- setSpeedLeft(double) - Method in class frc.robot.subsystems.Climber
- setSpeedRight(double) - Method in class frc.robot.subsystems.Climber
- setStreamMode_PiPMain(String) - Static method in class frc.robot.util.LimelightHelpers
- setStreamMode_PiPSecondary(String) - Static method in class frc.robot.util.LimelightHelpers
- setStreamMode_Standard(String) - Static method in class frc.robot.util.LimelightHelpers
- SetTargets(Constants.ShootingConstants.ShootingPosition) - Method in class frc.robot.subsystems.Arm
- SetTargets(Supplier<Double>) - Method in class frc.robot.subsystems.Arm
- SetTargetsAuto(Supplier<Double>) - Method in class frc.robot.subsystems.Arm
- setTeleopDisabledAnimation() - Method in class frc.robot.subsystems.LED
- setTeleopEnabledAnimation() - Method in class frc.robot.subsystems.LED
- setText(String) - Method in class frc.robot.util.Alert
-
Updates current alert text.
- setupPathPlanner() - Method in class frc.robot.subsystems.Drivetrain
-
Setup AutoBuilder for PathPlanner.
- Shoot() - Method in class frc.robot.subsystems.Head
- Shoot(boolean) - Method in class frc.robot.subsystems.Head
- Shoot(XboxController, XboxController, Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
-
will finish after piece has been shot
- Shoot(Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
-
will finish after piece has been shot
- Shoot(Arm, Head, boolean) - Static method in class frc.robot.commands.MechanismCommands
- SHOOTER_CAMERA_POSITION - Static variable in class frc.robot.Constants.VisionConstants
- ShooterConstants() - Constructor for class frc.robot.Constants.ShooterConstants
- ShootingConstants() - Constructor for class frc.robot.Constants.ShootingConstants
- ShuffleboardInfo - Class in frc.robot.shuffleboard
- ShuffleboardTabBase - Class in frc.robot.shuffleboard
-
The base for shuffleboard tabs.
- ShuffleboardTabBase() - Constructor for class frc.robot.shuffleboard.ShuffleboardTabBase
- simDriveCommand(DoubleSupplier, DoubleSupplier, DoubleSupplier) - Method in class frc.robot.subsystems.Drivetrain
-
Command to drive the robot using translative values and heading as a setpoint.
- simulationInit() - Method in class frc.robot.Robot
-
This function is called once when the robot is first started up.
- simulationPeriodic() - Method in class frc.robot.Robot
-
This function is called periodically whilst in simulation.
- simulationPeriodic() - Method in class frc.robot.subsystems.Drivetrain
- SLOW_SPEED_DECREMENT - Static variable in class frc.robot.Constants.SwerveConstants
- SOURCE_ANGLE - Static variable in class frc.robot.Constants.ArmConstants
- SpinDownShooter() - Method in class frc.robot.subsystems.Head
- SpinUpShooter(double) - Method in class frc.robot.subsystems.Head
- SpinUpShooter(Constants.ShootingConstants.ShootingPosition) - Method in class frc.robot.subsystems.Head
- StartIntake() - Method in class frc.robot.subsystems.Head
- StartOutake() - Method in class frc.robot.subsystems.Head
- StopIntake() - Method in class frc.robot.subsystems.Head
- stopShooter() - Method in class frc.robot.subsystems.Head
- StopShooter() - Method in class frc.robot.RobotContainer
- Stow() - Method in class frc.robot.subsystems.Arm
-
stows the arm and elevator
- STOW_ANGLE - Static variable in class frc.robot.Constants.ArmConstants
- StowStopIntakeAndShooter(Arm, Head) - Static method in class frc.robot.commands.MechanismCommands
-
cancel shoot and intake and stow
- SUBWOOFER - Enum constant in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
- SwerveConstants() - Constructor for class frc.robot.Constants.SwerveConstants
- SwerveTab - Class in frc.robot.shuffleboard
- SwerveTab(Drivetrain) - Constructor for class frc.robot.shuffleboard.SwerveTab
T
- ta - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- ta - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- ta - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- ta - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
- tagCount - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- tagSpan - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- takeSnapshot(String, String) - Static method in class frc.robot.util.LimelightHelpers
-
Asynchronously take snapshot.
- targetingResults - Variable in class frc.robot.util.LimelightHelpers.LimelightResults
- targets_Barcode - Variable in class frc.robot.util.LimelightHelpers.Results
- targets_Classifier - Variable in class frc.robot.util.LimelightHelpers.Results
- targets_Detector - Variable in class frc.robot.util.LimelightHelpers.Results
- targets_Fiducials - Variable in class frc.robot.util.LimelightHelpers.Results
- targets_Retro - Variable in class frc.robot.util.LimelightHelpers.Results
- teleopInit() - Method in class frc.robot.Robot
- teleopInit() - Method in class frc.robot.RobotContainer
- teleopPeriodic() - Method in class frc.robot.Robot
-
This function is called periodically during operator control.
- testInit() - Method in class frc.robot.Robot
- testPeriodic() - Method in class frc.robot.Robot
-
This function is called periodically during test mode.
- THE_NUMBER_THREE_TWO - Static variable in class frc.robot.Constants.SwerveConstants
- timestamp_LIMELIGHT_publish - Variable in class frc.robot.util.LimelightHelpers.Results
- timestamp_RIOFPGA_capture - Variable in class frc.robot.util.LimelightHelpers.Results
- timestampSeconds - Variable in class frc.robot.util.LimelightHelpers.PoseEstimate
- ToggleBrakeModes() - Method in class frc.robot.subsystems.Arm
- ToggleBreakModes() - Method in class frc.robot.subsystems.Head
- TOP_kD - Static variable in class frc.robot.Constants.ShooterConstants
- TOP_kF - Static variable in class frc.robot.Constants.ShooterConstants
- TOP_kI - Static variable in class frc.robot.Constants.ShooterConstants
- TOP_kMaxOutput - Static variable in class frc.robot.Constants.ShooterConstants
- TOP_kMinOutput - Static variable in class frc.robot.Constants.ShooterConstants
- TOP_kP - Static variable in class frc.robot.Constants.ShooterConstants
- ts - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- ts - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- TURN_TO_ANGLE_RANGE_FOR_END - Static variable in class frc.robot.Constants.SwerveConstants
- TURN_TO_TAG_RANGE_FOR_END - Static variable in class frc.robot.Constants.SwerveConstants
- turnAwayFromAmp() - Method in class frc.robot.RobotContainer
- turnSideways() - Method in class frc.robot.RobotContainer
- turnToAngleCommand(Rotation2d) - Method in class frc.robot.subsystems.Drivetrain
- turnToSpeaker() - Method in class frc.robot.RobotContainer
- turnToSpeaker(Supplier<Double>, Supplier<Double>) - Method in class frc.robot.RobotContainer
- TurnToTag - Class in frc.robot.commands.drivetrain
- TurnToTag(Drivetrain, int) - Constructor for class frc.robot.commands.drivetrain.TurnToTag
- TurnToTag(Drivetrain, int, boolean) - Constructor for class frc.robot.commands.drivetrain.TurnToTag
- TurnToTag(Drivetrain, int, boolean, Supplier<Double>, Supplier<Double>) - Constructor for class frc.robot.commands.drivetrain.TurnToTag
- TurnToTag(Drivetrain, int, Supplier<Double>, Supplier<Double>) - Constructor for class frc.robot.commands.drivetrain.TurnToTag
- tx - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- tx - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- tx - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- tx - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- tx_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- tx_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- tx_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- tx_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- txnc - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
- ty - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- ty - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- ty - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- ty - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- ty_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
- ty_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Detector
- ty_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Fiducial
- ty_pixels - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Retro
- tync - Variable in class frc.robot.util.LimelightHelpers.RawFiducial
U
- update() - Method in class frc.robot.shuffleboard.ArmTab
- update() - Method in class frc.robot.shuffleboard.ClimberTab
- update() - Method in class frc.robot.shuffleboard.DriverStationTab
- update() - Method in class frc.robot.shuffleboard.HeadTab
- update() - Method in class frc.robot.shuffleboard.LEDTab
- update() - Method in class frc.robot.shuffleboard.MotorTab
-
this MUST be called in periodic()
- update() - Method in class frc.robot.shuffleboard.ShuffleboardTabBase
-
This will be called every 20ms.
- update() - Method in class frc.robot.shuffleboard.SwerveTab
V
- valid - Variable in class frc.robot.util.LimelightHelpers.Results
- valueOf(String) - Static method in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
-
Returns the enum constant of this class with the specified name.
- valueOf(String) - Static method in enum class frc.robot.util.Alert.AlertType
-
Returns the enum constant of this class with the specified name.
- values() - Static method in enum class frc.robot.Constants.ShootingConstants.ShootingPosition
-
Returns an array containing the constants of this enum class, in the order they are declared.
- values() - Static method in enum class frc.robot.util.Alert.AlertType
-
Returns an array containing the constants of this enum class, in the order they are declared.
- VARIABLE_DISTANCE_SHOT - Static variable in class frc.robot.Constants.ShootingConstants
- VELOCITY_MAXIMUM - Static variable in class frc.robot.Constants.ShooterConstants
- VELOCITY_MINIMUM - Static variable in class frc.robot.Constants.ShooterConstants
- VisionConstants() - Constructor for class frc.robot.Constants.VisionConstants
W
- WARNING - Enum constant in enum class frc.robot.util.Alert.AlertType
-
Medium priority alert - displayed second on the dashboard with a yellow "!" symbol.
Z
- zeroGyro() - Method in class frc.robot.subsystems.Drivetrain
-
Resets the gyro angle to zero and resets odometry to the same position, but facing toward 0.
- zone - Variable in class frc.robot.util.LimelightHelpers.LimelightTarget_Classifier
All Classes and Interfaces|All Packages|Constant Field Values