Index

A B C D E F G H I J K L M N O P Q R S T U V W Z 
All Classes and Interfaces|All Packages|Constant Field Values

A

ABSOLUTE_ENCODER_OFFSET - Static variable in class frc.robot.Constants.ClimberConstants
 
AbsoluteEncoderLogger - Class in frc.robot.loggers.revlib
Custom logger for AbsoluteEncoders.
AbsoluteEncoderLogger() - Constructor for class frc.robot.loggers.revlib.AbsoluteEncoderLogger
Creates a new AbsoluteEncoderLogger.
ALGAE_HOLD_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Speed that the motor will use to keep force on the Algae while it is being held.
ALGAE_HOLD_TIME - Static variable in class frc.robot.Constants.EndEffectorConstants
Time algae is being held (in seconds) after intake
ALGAE_INTAKE_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Intake motor speed for algae.
ALGAE_MODE - Enum constant in enum class frc.robot.Constants.OperatorConstants.GamepieceMode
To interact with Algae
ALGAE_OUTAKE_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Outtake motor speed for algae.
ALGAE_OUTTAKE_RUN_TIME - Static variable in class frc.robot.Constants.EndEffectorConstants
Time (in seconds) that the motors run after algae outake is called to eject algae.
ALGAE_SCORING_OFFSET - Static variable in class frc.robot.Constants.FieldConstants.Reef
Offset from the AprilTag from which algae scoring should happen.
ALGAE_SCORING_POSE_BLUE - Static variable in class frc.robot.Constants.FieldConstants.Processor
Pose from which the robot can score algae on the blue alliance.
ALGAE_SCORING_POSE_RED - Static variable in class frc.robot.Constants.FieldConstants.Processor
Pose from which the robot can score algae on the red alliance.
ALGAE_SCORING_POSES_BLUE - Static variable in class frc.robot.Constants.FieldConstants.Reef
Poses from which the robot can score algae on the blue alliance.
ALGAE_SCORING_POSES_BLUE - Static variable in class frc.robot.Constants.ScoringPoses
Poses from which the robot can score algae on the blue alliance.
ALGAE_SCORING_POSES_RED - Static variable in class frc.robot.Constants.FieldConstants.Reef
Poses from which the robot can score algae on the red alliance.
ALGAE_SCORING_POSES_RED - Static variable in class frc.robot.Constants.ScoringPoses
Poses from which the robot can score algae on the red alliance.
AlgaeIntake() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
AlgaeOuttake() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
ambiguity - Variable in class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
ANGULAR_VELOCITY_COEFFICIENT - Static variable in class frc.robot.Constants.DrivetrainConstants.AngularVelocityCompensation
The angular velocity coefficient.
AngularVelocityCompensation() - Constructor for class frc.robot.Constants.DrivetrainConstants.AngularVelocityCompensation
 
Auto - Class in frc.robot.subsystems
Subsystem for the robot's autonomous functionality.
Auto() - Constructor for class frc.robot.subsystems.Auto
 
AUTO_TAB_NAME - Static variable in class frc.robot.Constants.DashboardConstants
The name of the tab used in Auto.
AutoConstants() - Constructor for class frc.robot.Constants.AutoConstants
 
autoInit() - Method in class frc.robot.RobotContainer
This method is run at the start of Auto.
Automations - Class in frc.robot.commands
This stores Automations, primarly to be used with Autonomous routines.
Automations() - Constructor for class frc.robot.commands.Automations
 
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.
avgTagArea - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
avgTagDist - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 

B

BACK_LIMELIGHT_NAME - Static variable in class frc.robot.Constants.VisionConstants
The name of the back Limelight on NetworkTables.
BarcodeTarget - Class in io.github.roboblazers7617.limelight.targets
Represents a Barcode Target Result extracted from JSON Output
BarcodeTarget() - Constructor for class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
BLUE - Enum constant in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
(Recommended) The robot's 3D pose in the WPILib Blue Alliance Coordinate System.
BLUE_MEGATAG2 - Enum constant in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
(Recommended) The robot's 3D pose in the WPILib Blue Alliance Coordinate System with MegaTag2.
BLUE_TAG_ID_FILTER - Static variable in class frc.robot.Constants.VisionConstants
The LimelightSettings.withArilTagIdFilter(List) to use on the blue alliance.
botpose - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
botpose_avgarea - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
botpose_avgdist - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
botpose_span - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
botpose_tagcount - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
botpose_wpiblue - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
botpose_wpired - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
BUILD_DATE - Static variable in class frc.robot.VersionConstants
Date on which the robot program was built in a human-readable format.
BUILD_UNIX_TIME - Static variable in class frc.robot.VersionConstants
Date on which the robot program was built in unix time.

C

camerapose_robotspace - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
CAN_ID_END_EFFECTOR - Static variable in class frc.robot.Constants.EndEffectorConstants
End Effector's Spark Max CAN ID.
centerModulesCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to center the modules of the SwerveDrive subsystem.
classId - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
classID - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
classID - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
ClassifierTarget - Class in io.github.roboblazers7617.limelight.targets.neural
Represents a Neural Classifier Pipeline Result extracted from JSON Output
ClassifierTarget() - Constructor for class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
className - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
className - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
CLIMB - Enum constant in enum class frc.robot.Constants.ArmPosition
 
Climber - Class in frc.robot.subsystems
Subsystem that controls the climber.
Climber() - Constructor for class frc.robot.subsystems.Climber
 
CLIMBER_GEAR_RATIO - Static variable in class frc.robot.Constants.ClimberConstants
Gear ratio for the climber mechanism.
CLIMBER_JUST_SPOOL_RATIO - Static variable in class frc.robot.Constants.ClimberConstants
 
CLIMBER_MOTOR_CAN_ID - Static variable in class frc.robot.Constants.ClimberConstants
CAN ID for the climber motor.
CLIMBER_RAISED_POSITION - Static variable in class frc.robot.Constants.ClimberConstants
Position where the climber is fully raised.
ClimberConstants() - Constructor for class frc.robot.Constants.ClimberConstants
 
CLOSED_LOOP_CONFIG - Static variable in class frc.robot.Constants.EndEffectorConstants
PID config for the motor controller.
CLOSED_LOOP_CONFIG - Static variable in class frc.robot.Constants.RampConstants
PID config for the motor controller.
confidence - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
confidence - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
CONFIG_DIR - Static variable in class frc.robot.Constants.DrivetrainConstants
Directory that contains the YAGSL configuration.
configureAutoBuilder(DriverStation.Alliance) - Method in class frc.robot.Dashboard
Configures the auto builder using the drivetrain subsystem.
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.ArmPosition - Enum Class in frc.robot
Constants with the arm and elevator positions for various positions.
Constants.AutoConstants - Class in frc.robot
Constants used to configure the autonomous program.
Constants.ClimberConstants - Class in frc.robot
Constants used to configure the climber.
Constants.DashboardConstants - Class in frc.robot
Constants used to configure the driver dashboard.
Constants.DrivetrainConstants - Class in frc.robot
Constants used by the Drivetrain.
Constants.DrivetrainConstants.AngularVelocityCompensation - Class in frc.robot
Angular velocity skew correction configuration.
Constants.DrivetrainConstants.EncoderAutoSynchronization - Class in frc.robot
Configure auto synchronization for encoders during a match.
Constants.DrivetrainConstants.Pathfinding - Class in frc.robot
Configure pathfinding to poses.
Constants.DrivetrainConstants.SysId - Class in frc.robot
SysId configuration.
Constants.ElevatorConstants - Class in frc.robot
Constants used to configure the elevator.
Constants.EndEffectorConstants - Class in frc.robot
Constants used to configure the End Effector.
Constants.FieldConstants - Class in frc.robot
Constants that describe the physical layout of the field.
Constants.FieldConstants.Processor - Class in frc.robot
Constants relating to the processor.
Constants.FieldConstants.Reef - Class in frc.robot
Constants relating to the reef.
Constants.LoggingConstants - Class in frc.robot
Constants used to configure logging.
Constants.OperatorConstants - Class in frc.robot
Constants used to configure the operator controllers.
Constants.OperatorConstants.GamepieceMode - Enum Class in frc.robot
Type of game piece for the robot to interact with.
Constants.RampConstants - Class in frc.robot
Constants used to configure the Ramp.
Constants.ScoringPoses - Class in frc.robot
Poses that the robot can score from.
Constants.VisionConstants - Class in frc.robot
Constants used to configure vision.
Constants.WristConstants - Class in frc.robot
Constants used to configure the wrist.
CORAL_BACKUP_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Intake motor speed for the coral to be behind secondary beam break for L4 scoring
CORAL_EMERGENCY_BACKUP_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Intake motor speed for backing up coral when in emergency mode
CORAL_EMERGENCY_MODE_INTAKE_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Intake motor speed for coral in emergency mode
CORAL_EMERGENCY_OUTTAKE_TIMER - Static variable in class frc.robot.Constants.EndEffectorConstants
Outtake timer for emergency coral outtake.
CORAL_MAIN_INTAKE_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Intake motor speed for coral.
CORAL_MODE - Enum constant in enum class frc.robot.Constants.OperatorConstants.GamepieceMode
To interact with Coral
CORAL_OUTAKE_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Outtake motor speed for coral.
CORAL_OUTTAKE_L4_WAIT - Static variable in class frc.robot.Constants.EndEffectorConstants
Coral wait after outtake.
CORAL_SCORING_OFFSET - Static variable in class frc.robot.Constants.FieldConstants.Reef
Offset from the AprilTag from which coral scoring should happen on the right side.
CORAL_SCORING_POSES_BLUE_LEFT - Static variable in class frc.robot.Constants.FieldConstants.Reef
Poses from which the robot can score coral on the left side on the blue alliance.
CORAL_SCORING_POSES_BLUE_LEFT - Static variable in class frc.robot.Constants.ScoringPoses
Poses from which the robot can score coral on the left side on the blue alliance.
CORAL_SCORING_POSES_BLUE_RIGHT - Static variable in class frc.robot.Constants.FieldConstants.Reef
Poses from which the robot can score coral on the right side on the blue alliance.
CORAL_SCORING_POSES_BLUE_RIGHT - Static variable in class frc.robot.Constants.ScoringPoses
Poses from which the robot can score coral on the right side on the blue alliance.
CORAL_SCORING_POSES_RED_LEFT - Static variable in class frc.robot.Constants.FieldConstants.Reef
Poses from which the robot can score coral on the left side on the red alliance.
CORAL_SCORING_POSES_RED_LEFT - Static variable in class frc.robot.Constants.ScoringPoses
Poses from which the robot can score coral on the left side on the red alliance.
CORAL_SCORING_POSES_RED_RIGHT - Static variable in class frc.robot.Constants.FieldConstants.Reef
Poses from which the robot can score coral on the right side on the red alliance.
CORAL_SCORING_POSES_RED_RIGHT - Static variable in class frc.robot.Constants.ScoringPoses
Poses from which the robot can score coral on the right side on the red alliance.
CORAL_SECONDARY_INTAKE_SPEED - Static variable in class frc.robot.Constants.EndEffectorConstants
Intake motor speed for coral after hitting main beam break.
CORAL_SINGLE_BEAM_ADJUSTER_OUTTAKE_WAITTIME - Static variable in class frc.robot.Constants.EndEffectorConstants
When using single beam break commands offsets time when it will check for beam break.
CoralBackup() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
CoralIntakeFinish() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
CoralIntakeStart() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
CoralIntakeTeleop() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
CoralOuttake() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
CoralOuttakeTeleop() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
corner0_X - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner0_Y - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner1_X - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner1_Y - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner2_X - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner2_Y - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner3_X - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corner3_Y - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
corners - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
createNamedCommands() - Method in class frc.robot.RobotContainer
 
createNamedCommands(Drivetrain, EndEffector, Elevator) - Method in class frc.robot.commands.Automations
 
CURRENT_LIMIT - Static variable in class frc.robot.Constants.ElevatorConstants
Current limit in amps.
CURRENT_LIMIT - Static variable in class frc.robot.Constants.WristConstants
Current limit in amps.

D

Dashboard - Class in frc.robot
A class that sets up the driverstation dashboard for the robot.
Dashboard(Drivetrain, RobotContainer) - Constructor for class frc.robot.Dashboard
Creates a new Dashboard.
DashboardConstants() - Constructor for class frc.robot.Constants.DashboardConstants
 
data - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
Gets the decoded data content of the barcode
dataCollator - Variable in class io.github.roboblazers7617.limelight.Limelight
 
DEADBAND - Static variable in class frc.robot.Constants.DrivetrainConstants.EncoderAutoSynchronization
Deadband in degrees.
DEADBAND - Static variable in class frc.robot.Constants.OperatorConstants
Joystick deadband.
DEBUG_LEVEL - Static variable in class frc.robot.Constants.LoggingConstants
Log all data above specified level.
DEBUG_MODE - Static variable in class frc.robot.Constants.LoggingConstants
Send logging data to NetworkTables.
DELAY - Static variable in class frc.robot.Constants.DrivetrainConstants.SysId
Delay in seconds between each section.
DetectorTarget - Class in io.github.roboblazers7617.limelight.targets.neural
Represents a Neural Detector Pipeline Result extracted from JSON Output
DetectorTarget() - Constructor for class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
DIRTY - Static variable in class frc.robot.VersionConstants
Are there uncommited changes?
DISABLED_IMU_MODE - Static variable in class frc.robot.Constants.VisionConstants
The LimelightSettings.ImuMode to use while disabled.
DISABLED_UPDATE_FREQUENCY - Static variable in class frc.robot.Constants.VisionConstants
The frequency of processed vision frames while disabled.
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 io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
distToRobot - Variable in class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
doNothing() - Method in class frc.robot.subsystems.Elevator
A command that does nothing.
DoubleDownscale - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Double downscaling, equivalent to 2
drive(Translation2d, double, boolean) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
The primary method for controlling the drivebase.
drive(ChassisSpeeds) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Drive according to the chassis robot oriented velocity.
drive(ChassisSpeeds, Drivetrain.TranslationOrientation) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Drives the robot with the given translation orientation.
driveAngularCommand(DoubleSupplier, DoubleSupplier, DoubleSupplier) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to drive the robot using translative values and heading as angular velocity.
driveAngularVelocity(CommandXboxController) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
A copy of DrivetrainControls.driveGeneric(CommandXboxController) that uses angular velocity control for turning.
driveAngularVelocityCommand(CommandXboxController, Drivetrain.TranslationOrientation) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
DrivetrainControls.driveInputStreamScaledCommand(SwerveInputStream, TranslationOrientation) that uses DrivetrainControls.driveAngularVelocity(CommandXboxController).
driveDirectAngle(CommandXboxController) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
A copy of DrivetrainControls.driveGeneric(CommandXboxController) that uses heading control for turning.
driveDirectAngleCommand(CommandXboxController, Drivetrain.TranslationOrientation) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
DrivetrainControls.driveInputStreamScaledCommand(SwerveInputStream, TranslationOrientation) that uses DrivetrainControls.driveDirectAngle(CommandXboxController).
driveDirectAngleSim(CommandXboxController) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
A copy of DrivetrainControls.driveGeneric(CommandXboxController) that pulls rotation from controller axis 2 for use in simulation.
driveDirectAngleSimCommand(CommandXboxController, Drivetrain.TranslationOrientation) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
DrivetrainControls.driveInputStreamScaledCommand(SwerveInputStream, TranslationOrientation) that uses DrivetrainControls.driveDirectAngleSim(CommandXboxController).
driveFieldOriented(ChassisSpeeds) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Drive the robot given a chassis field oriented velocity.
driveFieldOrientedCommand(Supplier<ChassisSpeeds>) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Drive the robot given a chassis field oriented velocity.
driveHeadingCommand(DoubleSupplier, DoubleSupplier, DoubleSupplier, DoubleSupplier) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to drive the robot using translative values and heading as a setpoint.
DRIVER_CONTROLLER_PORT - Static variable in class frc.robot.Constants.OperatorConstants
Controller port index where the driver controller is connected.
driveStaticHeading(CommandXboxController, Supplier<Rotation2d>) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
A copy of DrivetrainControls.driveGeneric(CommandXboxController) that uses a preset heading.
driveStaticHeadingCommand(CommandXboxController, Drivetrain.TranslationOrientation, Supplier<Rotation2d>) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
DrivetrainControls.driveInputStreamScaledCommand(SwerveInputStream, TranslationOrientation) that uses DrivetrainControls.driveStaticHeading(CommandXboxController, Supplier).
driveStaticHeadingNearestPoseCommand(CommandXboxController, Drivetrain.TranslationOrientation, List<Pose2d>) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
driveToDistanceCommand(double, double) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command that drives the swerve drive to a specific distance at a given speed.
driveToNearestPoseCommand(List<Pose2d>) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Drives to the nearest pose out of a list.
driveToPoseCommand(Supplier<Pose2d>) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Use PathPlanner Path finding to go to a point on the field.
Drivetrain - Class in frc.robot.subsystems.drivetrain
Subsystem that controls the drivetrain.
Drivetrain(File) - Constructor for class frc.robot.subsystems.drivetrain.Drivetrain
Initialize SwerveDrive with the directory provided.
Drivetrain.TranslationOrientation - Enum Class in frc.robot.subsystems.drivetrain
The frame of reference for drivetrain translation.
DrivetrainConstants() - Constructor for class frc.robot.Constants.DrivetrainConstants
 
DrivetrainControls - Class in frc.robot.subsystems.drivetrain
Class that handles controlling the Drivetrain with HID controllers.
DrivetrainControls(Drivetrain) - Constructor for class frc.robot.subsystems.drivetrain.DrivetrainControls
Creates a new DrivetrainControls.
driveWithSetpointGeneratorFieldRelativeCommand(Supplier<ChassisSpeeds>) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Drive with 254's Setpoint generator; port written by PathPlanner.
DYNAMIC_TIMEOUT - Static variable in class frc.robot.Constants.DrivetrainConstants.SysId
Time in seconds to run Dynamic routines.

E

Elastic - Class in frc.robot.util
 
Elastic() - Constructor for class frc.robot.util.Elastic
 
Elastic.Notification - Class in frc.robot.util
Represents an notification object to be sent to the Elastic dashboard.
Elastic.Notification.NotificationLevel - Enum Class in frc.robot.util
Represents the possible levels of notifications for the Elastic dashboard.
Elevator - Class in frc.robot.subsystems
 
Elevator(RobotContainer) - Constructor for class frc.robot.subsystems.Elevator
Creates a new Elevator.
ELEVATOR_POSITION - Variable in enum class frc.robot.Constants.ArmPosition
The elevator position in meters.
ElevatorConstants() - Constructor for class frc.robot.Constants.ElevatorConstants
 
elevatorInit() - Method in class frc.robot.subsystems.Elevator
 
ENABLE_COSINE_COMPENSATION - Static variable in class frc.robot.Constants.DrivetrainConstants
ENABLE_HEADING_CORRECTION - Static variable in class frc.robot.Constants.DrivetrainConstants
ENABLE_VISION - Static variable in class frc.robot.Constants.VisionConstants
Enable vision odometry updates.
ENABLED - Static variable in class frc.robot.Constants.DrivetrainConstants.EncoderAutoSynchronization
Enable auto synchronization.
ENABLED_IMU_MODE - Static variable in class frc.robot.Constants.VisionConstants
The LimelightSettings.ImuMode to use while enabled.
EncoderAutoSynchronization() - Constructor for class frc.robot.Constants.DrivetrainConstants.EncoderAutoSynchronization
 
end(boolean) - Method in class frc.robot.commands.drivetrain.LockWheelsCommand
 
end(boolean) - Method in class frc.robot.commands.WaitUntilInterrupt
 
EndEffector - Class in frc.robot.subsystems.EndEffector
Subsystem for the robot's End Effector functionality
EndEffector(RobotContainer) - Constructor for class frc.robot.subsystems.EndEffector.EndEffector
Creates a new EndEffector.
EndEffectorConstants() - Constructor for class frc.robot.Constants.EndEffectorConstants
 
error - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
ERROR - Enum constant in enum class frc.robot.util.Elastic.Notification.NotificationLevel
Error message
execute() - Method in class frc.robot.commands.drivetrain.LockWheelsCommand
 
execute() - Method in class frc.robot.commands.RunOnceDeferred
 
ExternalAssistInternalIMU - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Use internal IMU for MT2 localization while correcting it with external IMU updates from Limelight.setRobotOrientation(edu.wpi.first.math.geometry.Rotation3d).
ExternalImu - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Use external IMU yaw submitted via Limelight.setRobotOrientation(edu.wpi.first.math.geometry.Rotation3d) for MT2 localization.
extractArrayEntry(double[], int) - Static method in class io.github.roboblazers7617.limelight.JsonUtilities
 

F

FACE_POSES_BLUE - Static variable in class frc.robot.Constants.FieldConstants.Reef
Center poses for the reef faces on the blue alliance.
FACE_POSES_RED - Static variable in class frc.robot.Constants.FieldConstants.Reef
Center poses for the reef faces on the red alliance.
family - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
Barcode family type (e.g.
fiducialFamily - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
fiducialID - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
FiducialTarget - Class in io.github.roboblazers7617.limelight.targets
Represents an AprilTag/Fiducial Target Result extracted from JSON Output
FiducialTarget() - Constructor for class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
FIELD_LAYOUT - Static variable in class frc.robot.Constants.FieldConstants
AprilTag Field Layout for the current game.
FIELD_RELATIVE - Enum constant in enum class frc.robot.subsystems.drivetrain.Drivetrain.TranslationOrientation
Translation relative to the field rotation.
FieldConstants() - Constructor for class frc.robot.Constants.FieldConstants
 
flipPoseAlliance(Pose2d) - Static method in class frc.robot.util.PoseUtil
Flips a pose to the other alliance.
flipTransformY(Transform2d) - Static method in class frc.robot.util.PoseUtil
Flips a transform across the X axis (inverts the Y axis).
flipTranslationAlliance(Translation2d) - Static method in class frc.robot.util.PoseUtil
Flips a translation to the other alliance.
ForceBlink - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.LEDMode
 
ForceOff - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.LEDMode
 
ForceOn - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.LEDMode
 
frc.robot - package frc.robot
FRC Team 7617's 2025 season robot code.
frc.robot.commands - package frc.robot.commands
Custom Commands to aid in controlling the robot.
frc.robot.commands.drivetrain - package frc.robot.commands.drivetrain
Commands to aid in controlling the Drivetrain.
frc.robot.loggers - package frc.robot.loggers
Custom logger classes.
frc.robot.loggers.revlib - package frc.robot.loggers.revlib
 
frc.robot.loggers.revlib.structs - package frc.robot.loggers.revlib.structs
 
frc.robot.subsystems - package frc.robot.subsystems
Classes that control the robot's subsystems.
frc.robot.subsystems.drivetrain - package frc.robot.subsystems.drivetrain
Classes that control the robot's Drivetrain.
frc.robot.subsystems.EndEffector - package frc.robot.subsystems.EndEffector
 
frc.robot.subsystems.IntakeRamp - package frc.robot.subsystems.IntakeRamp
 
frc.robot.subsystems.vision - package frc.robot.subsystems.vision
 
frc.robot.util - package frc.robot.util
Utility classes to aid in controlling the robot.
FRONT_LIMELIGHT_NAME - Static variable in class frc.robot.Constants.VisionConstants
The name of the front Limelight on NetworkTables.

G

GEAR_RATIO_END_EFFECTOR_MOTOR - Static variable in class frc.robot.Constants.EndEffectorConstants
End Effector's motor gear ratio.
getAutonomousCommand() - Method in class frc.robot.RobotContainer
Use this to pass the autonomous command to the main Robot class.
getAutonomousCommand(String) - Static method in class frc.robot.subsystems.Auto
Get the path follower with events.
getBotPose2d() - Method in class io.github.roboblazers7617.limelight.PipelineResult
 
getBotPose2d_wpiBlue() - Method in class io.github.roboblazers7617.limelight.PipelineResult
 
getBotPose2d_wpiRed() - Method in class io.github.roboblazers7617.limelight.PipelineResult
 
getBotPose3d() - Method in class io.github.roboblazers7617.limelight.PipelineResult
 
getBotPose3d_TargetSpace() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the robot's 3D pose with respect to the currently tracked target's coordinate system.
getBotPose3d_wpiBlue() - Method in class io.github.roboblazers7617.limelight.PipelineResult
 
getBotPose3d_wpiRed() - Method in class io.github.roboblazers7617.limelight.PipelineResult
 
getBotPoseEstimates() - Method in class io.github.roboblazers7617.limelight.PoseEstimator
 
getCameraPose_TargetSpace() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getCameraPose_TargetSpace() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getCameraPose_TargetSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getCameraPose_TargetSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getCameraPose3d_RobotSpace() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the camera's 3D pose with respect to the robot's coordinate system.
getCameraPose3d_TargetSpace() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the camera's 3D pose with respect to the currently tracked target's coordinate system.
getClassifierClass() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the current neural classifier result class name.
getClassifierClassIndex() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the classifier class index from the currently running neural classifier pipeline
getCurrentPipelineIndex() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the active pipeline index.
getCurrentPipelineType() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the current pipeline type.
getDescription() - Method in class frc.robot.util.Elastic.Notification
 
getDetectedTags() - Method in class io.github.roboblazers7617.limelight.PoseEstimate
 
getDetectorClass() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the primary neural detector result class name.
getDetectorClassIndex() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the detector class index from the primary result of the currently running neural detector pipeline.
getDisplayTimeMillis() - Method in class frc.robot.util.Elastic.Notification
Gets the display time of the notification in milliseconds
getElevatorTarget() - Method in class frc.robot.subsystems.Elevator
 
getEntry() - Method in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
 
getFamily() - Method in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
getFiducialID() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
 
getFieldVelocity() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the current field-relative velocity (x, y and omega) of the robot.
getGamepieceMode() - Method in class frc.robot.RobotContainer
Gets the RobotContainer.gamepieceMode.
getHeading() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the current yaw angle of the robot, as reported by the swerve pose estimator in the underlying drivebase.
getHeight() - Method in class frc.robot.util.Elastic.Notification
Gets the height of the notification
getJSONDump() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the full JSON results dump.
getKinematics() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Get the swerve drive kinematics object.
getLatency_Capture() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the capture latency.
getLatency_Pipeline() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the pipeline's processing latency contribution.
getLatestResults(boolean) - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the latest JSON results output and returns a LimelightResults object.
getLevel() - Method in class frc.robot.util.Elastic.Notification
 
getLimelightURLString(String) - Method in class io.github.roboblazers7617.limelight.Limelight
 
getNeuralClassID() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
 
getPitch() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the current pitch angle of the robot, as reported by the imu.
getPose() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the current pose (position and rotation) of the robot, as reported by odometry.
getPose2d() - Method in class io.github.roboblazers7617.limelight.PoseEstimate
 
getPose3d() - Method in class io.github.roboblazers7617.limelight.PoseEstimate
 
getRawBarcodeData() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
 
getRawDetections() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the latest raw neural detector results from NetworkTables name
getRawFiducialTargets() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the latest raw fiducial/AprilTag detection results from NetworkTables.
getRawFiducialTargets() - Method in class io.github.roboblazers7617.limelight.PoseEstimator
Gets the latest raw fiducial/AprilTag detection results from NetworkTables.
getRobotPose_FieldSpace() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getRobotPose_FieldSpace() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getRobotPose_FieldSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getRobotPose_FieldSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getRobotPose_TargetSpace() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getRobotPose_TargetSpace() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getRobotPose_TargetSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getRobotPose_TargetSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getRobotVelocity() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the current velocity (x, y and omega) of the robot.
getSchema() - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
getSchema() - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
getSize() - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
getSize() - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
getSwerveController() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Get the SwerveController in the swerve drive.
getSwerveDrive() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the swerve drive object.
getSwerveDriveConfiguration() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Get the SwerveDriveConfiguration object.
getT2DArray() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
T2D is an array that contains several targeting metrcis
getTA() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the target area as a percentage of the image (0-100%).
getTagCount() - Method in class io.github.roboblazers7617.limelight.PoseEstimate
 
getTargetColor() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
 
getTargetCount() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the number of targets currently detected.
getTargetPose_CameraSpace() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getTargetPose_CameraSpace() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getTargetPose_CameraSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getTargetPose_CameraSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getTargetPose_RobotSpace() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getTargetPose_RobotSpace() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getTargetPose_RobotSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
getTargetPose_RobotSpace2D() - Method in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
getTargetPose3d_CameraSpace() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the target's 3D pose with respect to the camera's coordinate system.
getTargetPose3d_RobotSpace() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the target's 3D pose with respect to the robot's coordinate system.
getTimestampSeconds() - Method in class io.github.roboblazers7617.limelight.PoseEstimate
 
getTitle() - Method in class frc.robot.util.Elastic.Notification
Gets the title of this notification
getTV() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Does the Limelight have a valid target?
getTX() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the horizontal offset from the crosshair to the target in degrees.
getTXNC() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the horizontal offset from the principal pixel/point to the target in degrees.
getTY() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the vertical offset from the crosshair to the target in degrees.
getTYNC() - Method in class io.github.roboblazers7617.limelight.PipelineDataCollator
Gets the vertical offset from the principal pixel/point to the target in degrees.
getTypeClass() - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
getTypeClass() - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
getTypeName() - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
getTypeName() - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
getVision() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Gets the vision object.
getWidth() - Method in class frc.robot.util.Elastic.Notification
Gets the width of the notification
GIT_BRANCH - Static variable in class frc.robot.VersionConstants
Git branch.
GIT_DATE - Static variable in class frc.robot.VersionConstants
Git commit date.
GIT_REVISION - Static variable in class frc.robot.VersionConstants
Git revision number.
GIT_SHA - Static variable in class frc.robot.VersionConstants
Git commit hash.

H

HalfDownscale - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Half downscaling, equivalent to 1.5

I

id - Variable in class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
INFO - Enum constant in enum class frc.robot.util.Elastic.Notification.NotificationLevel
Informational Message
initialize() - Method in class frc.robot.commands.drivetrain.LockWheelsCommand
 
initialize() - Method in class frc.robot.commands.WaitUntilInterrupt
 
inst - Static variable in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
Static instance of the struct.
inst - Static variable in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
Static instance of the struct.
INTAKE_ALGAE_LEVEL_2 - Enum constant in enum class frc.robot.Constants.ArmPosition
 
INTAKE_ALGAE_LEVEL_3 - Enum constant in enum class frc.robot.Constants.ArmPosition
 
INTAKE_CORAL_CORAL_STATION - Enum constant in enum class frc.robot.Constants.ArmPosition
 
InternalImu - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Use internal IMU for MT2 localization.
io.github.roboblazers7617.limelight - package io.github.roboblazers7617.limelight
 
io.github.roboblazers7617.limelight.targets - package io.github.roboblazers7617.limelight.targets
 
io.github.roboblazers7617.limelight.targets.neural - package io.github.roboblazers7617.limelight.targets.neural
 
isFinished() - Method in class frc.robot.commands.drivetrain.LockWheelsCommand
 
isFinished() - Method in class frc.robot.commands.RunOnceDeferred
 
isFinished() - Method in class frc.robot.commands.WaitUntilInterrupt
 
isHoldingAlgae() - Method in class frc.robot.RobotContainer
 
isHoldingAlgae() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
isHoldingCoral() - Method in class frc.robot.RobotContainer
 
isHoldingCoral() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
isImmutable() - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
isImmutable() - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
isMegaTag2 - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
isMegaTag2() - Method in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
 
isRedAlliance() - Static method in class frc.robot.util.Util
Checks if the alliance is red, defaults to false if alliance isn't available.

J

JsonUtilities - Class in io.github.roboblazers7617.limelight
 
JsonUtilities() - Constructor for class io.github.roboblazers7617.limelight.JsonUtilities
 

K

KD - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kD.
KD - Static variable in class frc.robot.Constants.WristConstants
Wrist kD.
KG - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kG.
KG - Static variable in class frc.robot.Constants.WristConstants
Wrist kG.
KI - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kI.
KI - Static variable in class frc.robot.Constants.WristConstants
Wrist kI.
KMAX_OUTPUT - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kMaxOutput as a percentage.
KMAX_OUTPUT - Static variable in class frc.robot.Constants.WristConstants
Wrist kMaxOutput.
KMIN_OUTPUT - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kMinOutput as a percentage.
KMIN_OUTPUT - Static variable in class frc.robot.Constants.WristConstants
Wrist kMinOutput.
KP - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kP.
KP - Static variable in class frc.robot.Constants.WristConstants
Wrist kP.
KS - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kS.
KS - Static variable in class frc.robot.Constants.WristConstants
Wrist kS.
KV - Static variable in class frc.robot.Constants.ElevatorConstants
Elevator kV.
KV - Static variable in class frc.robot.Constants.WristConstants
Wrist kV.

L

latency - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
latency_capture - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
latency_jsonParse - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
latency_pipeline - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
LEFT_MOTOR_ID - Static variable in class frc.robot.Constants.ElevatorConstants
CAN ID for the left elevator motor.
Limelight - Class in io.github.roboblazers7617.limelight
 
Limelight(String) - Constructor for class io.github.roboblazers7617.limelight.Limelight
 
LimelightSettings - Class in io.github.roboblazers7617.limelight
Settings class to apply configurable options to the Limelight Sourced from Yet Another Limelight Lib(YALL)
LimelightSettings(Limelight) - Constructor for class io.github.roboblazers7617.limelight.LimelightSettings
Create a LimelightSettings object with all configurable features of a Limelight.
LimelightSettings.DownscalingOverride - Enum Class in io.github.roboblazers7617.limelight
Downscaling Override Enum for Limelight
LimelightSettings.ImuMode - Enum Class in io.github.roboblazers7617.limelight
IMU Mode Enum for the Limelight
LimelightSettings.LEDMode - Enum Class in io.github.roboblazers7617.limelight
LED Mode for the Limelight.
LimelightSettings.StreamMode - Enum Class in io.github.roboblazers7617.limelight
Stream mode for the Limelight
LIMIT_SWITCH_DIO - Static variable in class frc.robot.Constants.EndEffectorConstants
DIO pin for limit switch.
lock() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Lock the swerve drive to prevent it from moving.
lockCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to lock the swerve drive to prevent it from moving.
LockWheelsCommand - Class in frc.robot.commands.drivetrain
A command that locks the wheels of the swerve drive to force it to remain stationary.
LockWheelsCommand(Drivetrain) - Constructor for class frc.robot.commands.drivetrain.LockWheelsCommand
Creates a new LockWheelsState.
LoggingConstants() - Constructor for class frc.robot.Constants.LoggingConstants
 
LOWER_CLIMBER_SPEED - Static variable in class frc.robot.Constants.ClimberConstants
Speed at which the climber is lowered.
LowerClimber() - Method in class frc.robot.subsystems.Climber
Engages the ratchet and lowers the climber.

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.
MAIN_BEAM_BREAK_DIO - Static variable in class frc.robot.Constants.EndEffectorConstants
DIO pin for the main beam break.
makePoseEstimator(PoseEstimator.PoseEstimators) - Method in class io.github.roboblazers7617.limelight.Limelight
 
manualCoralBackup() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
manualCoralIntake() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
manualCoralOuttake() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
MAVEN_GROUP - Static variable in class frc.robot.VersionConstants
Maven group which the robot package belongs to.
MAVEN_NAME - Static variable in class frc.robot.VersionConstants
Maven package name of the robot package.
MAX_ACCELERATION - Static variable in class frc.robot.Constants.ElevatorConstants
Maximum acceleration in m/s^2.
MAX_ACCELERATION - Static variable in class frc.robot.Constants.WristConstants
Maximum acceleration in degrees/s^2.
MAX_ALGAE_POSITION_WITH_ELEVATOR - Static variable in class frc.robot.Constants.WristConstants
Maximum position that the wrist can be while holding an algae (to make sure it doesn't hit the elevator), in degrees.
MAX_ALGAE_POSITION_WITHOUT_ELEVATOR - Static variable in class frc.robot.Constants.WristConstants
Maximum position that the wrist can be while holding an algae if the elevator is fully extended, in degrees.
MAX_ANGULAR_ACCELERATION - Static variable in class frc.robot.Constants.DrivetrainConstants.Pathfinding
Maximum angular acceleration.
MAX_CURRENT_LIMIT - Static variable in class frc.robot.Constants.EndEffectorConstants
Neo's current limit.
MAX_LINEAR_ACCELERATION - Static variable in class frc.robot.Constants.DrivetrainConstants.Pathfinding
Maximium linear acceleration.
MAX_LOWERED_POSITION - Static variable in class frc.robot.Constants.ElevatorConstants
This is the maximum position for the elevator to be considered lowered, in meters.
MAX_POSITION - Static variable in class frc.robot.Constants.ElevatorConstants
Maximum position in meters.
MAX_POSITION - Static variable in class frc.robot.Constants.WristConstants
Maximum position in degrees.
MAX_SPEED - Static variable in class frc.robot.Constants.DrivetrainConstants
Maximum speed of the robot in meters per second.
MAX_VELOCITY - Static variable in class frc.robot.Constants.ElevatorConstants
Maximum velocity in m/s.
MAX_VELOCITY - Static variable in class frc.robot.Constants.WristConstants
Maximum velocity in degrees/s.
MAX_VOLTS - Static variable in class frc.robot.Constants.DrivetrainConstants.SysId
The maximum voltage to apply to the drive motors.
MIN_POSITION - Static variable in class frc.robot.Constants.ElevatorConstants
Minimum position in meters.
MIN_POSITION - Static variable in class frc.robot.Constants.WristConstants
Minimum position when the elevator is not lowered, (determined by MAX_LOWERED_POSITION) in degrees.
MOTOR_ID - Static variable in class frc.robot.Constants.WristConstants
CAN Motor ID for the wrist.
MT1AssistInternalImu - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Use internal IMU for MT2 localization while using correcting it with estimated yaws from MT1.

N

name - Variable in class io.github.roboblazers7617.limelight.Limelight
 
networkTable - Variable in class io.github.roboblazers7617.limelight.Limelight
 
NoDownscale - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
No downscaling, equivalent to 1
Notification() - Constructor for class frc.robot.util.Elastic.Notification
Creates a new Notification with all default parameters.
Notification(Elastic.Notification.NotificationLevel, String, String) - Constructor for class frc.robot.util.Elastic.Notification
Creates a new Notification with default display time and dimensions.
Notification(Elastic.Notification.NotificationLevel, String, String, double, double) - Constructor for class frc.robot.util.Elastic.Notification
Creates a new Notification with specified dimensions and default display time.
Notification(Elastic.Notification.NotificationLevel, String, String, int) - Constructor for class frc.robot.util.Elastic.Notification
Creates a new Notification with a specified display time and default dimensions.
Notification(Elastic.Notification.NotificationLevel, String, String, int, double, double) - Constructor for class frc.robot.util.Elastic.Notification
Creates a new Notification with all properties specified.

O

OPERATOR_CONTROLLER_PORT - Static variable in class frc.robot.Constants.OperatorConstants
Controller port index where the operator controller is connected.
OperatorConstants() - Constructor for class frc.robot.Constants.OperatorConstants
 
OUTTAKE_ALGAE_NET - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_ALGAE_PROCESSOR - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_CORAL_LEVEL_1 - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_CORAL_LEVEL_2 - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_CORAL_LEVEL_3 - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_CORAL_LEVEL_4 - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_CORAL_LEVEL_4_HIGH - Enum constant in enum class frc.robot.Constants.ArmPosition
 
OUTTAKE_WAIT_TIME - Static variable in class frc.robot.Constants.EndEffectorConstants
Time (in seconds) that the motors run after beam break detects no coral after using the outtake command

P

pack(ByteBuffer, Integer) - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
pack(ByteBuffer, Integer) - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
Pathfinding() - Constructor for class frc.robot.Constants.DrivetrainConstants.Pathfinding
 
periodic() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
 
periodic() - Method in class frc.robot.subsystems.Elevator
This method is responsible for they safety of the elevator and wrist.
periodic() - Method in class frc.robot.subsystems.EndEffector.EndEffector
 
periodic() - Method in class frc.robot.subsystems.IntakeRamp.Ramp
 
PictureInPictureMain - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.StreamMode
Picture in picture, with secondary in corner.
PictureInPictureSecondary - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.StreamMode
Picture in picture, with main in corner.
Pipeline - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Pipeline downscaling, equivalent to 0
PipelineControl - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.LEDMode
 
PipelineDataCollator - Class in io.github.roboblazers7617.limelight
 
PipelineDataCollator(Limelight) - Constructor for class io.github.roboblazers7617.limelight.PipelineDataCollator
 
pipelineID - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
PipelineResult - Class in io.github.roboblazers7617.limelight
Limelight PipelineResult object, parsed from a Limelight's JSON results output.
PipelineResult() - Constructor for class io.github.roboblazers7617.limelight.PipelineResult
 
pose - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
POSE_ESTIMATOR_TYPE - Static variable in class frc.robot.Constants.VisionConstants
Use MegaTag2 for pose estimation.
pose2dToArray(Pose2d) - Static method in class io.github.roboblazers7617.limelight.JsonUtilities
Converts a Pose2d object to an array of doubles in the format [x, y, z, roll, pitch, yaw].
pose3dToArray(Pose3d) - Static method in class io.github.roboblazers7617.limelight.JsonUtilities
Converts a Pose3d object to an array of doubles in the format [x, y, z, roll, pitch, yaw].
PoseEstimate - Class in io.github.roboblazers7617.limelight
Represents a 3D Pose Estimate.
PoseEstimate() - Constructor for class io.github.roboblazers7617.limelight.PoseEstimate
Instantiates a PoseEstimate object with default values
PoseEstimate(Pose3d, double, double, int, double, double, double, RawFiducialTarget[], boolean) - Constructor for class io.github.roboblazers7617.limelight.PoseEstimate
 
PoseEstimator - Class in io.github.roboblazers7617.limelight
 
PoseEstimator(Limelight, PoseEstimator.PoseEstimators) - Constructor for class io.github.roboblazers7617.limelight.PoseEstimator
 
PoseEstimator.PoseEstimators - Enum Class in io.github.roboblazers7617.limelight
PoseEstimators enum for easier decoding.
PoseUtil - Class in frc.robot.util
Utility classes for working with poses.
PoseUtil() - Constructor for class frc.robot.util.PoseUtil
 
POSITION_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.ElevatorConstants
Conversion factor from rotation to meters.
POSITION_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.EndEffectorConstants
 
POSITION_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.RampConstants
Used for controlling the position of the motor correctly.
POSITION_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.WristConstants
Conversion factor from rotation to degrees.
postTrajectory(Trajectory) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Post the trajectory to the field.
printPoseEstimate(PoseEstimate) - Method in class io.github.roboblazers7617.limelight.PoseEstimator
Prints detailed information about a PoseEstimate to standard output.
Processor() - Constructor for class frc.robot.Constants.FieldConstants.Processor
 
publishNetworkTables(NetworkTable) - Static method in class frc.robot.VersionConstants
Publish version metadata to a NetworkTable.

Q

QuadrupleDownscale - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Quadruple downscaling, equivalent to 4
QUASI_TIMEOUT - Static variable in class frc.robot.Constants.DrivetrainConstants.SysId
Time in seconds to run Quasistatic routines.

R

RAISE_CLIMBER_SPEED - Static variable in class frc.robot.Constants.ClimberConstants
Speed at which the climber is raised.
RaiseClimber(double) - Method in class frc.robot.subsystems.Climber
Disengages the ratchet and raises the climber.
Ramp - Class in frc.robot.subsystems.IntakeRamp
Subsystem for the robot's Ramp functionality.
Ramp() - Constructor for class frc.robot.subsystems.IntakeRamp.Ramp
Creates a new Ramp.
RAMP_DEPLOY_POSITION - Static variable in class frc.robot.Constants.RampConstants
Ramp deploy position.
RAMP_MOTOR_CAN_ID - Static variable in class frc.robot.Constants.RampConstants
Ramp CAN ID.
RAMP_MOTOR_CURRENT_LIMIT - Static variable in class frc.robot.Constants.RampConstants
Ramp motor's current limit.
RAMP_MOTOR_GEAR_RATIO - Static variable in class frc.robot.Constants.RampConstants
Ramp gear ratio.
RAMP_STOW_POSITION - Static variable in class frc.robot.Constants.RampConstants
Ramp stow position.
RampConstants() - Constructor for class frc.robot.Constants.RampConstants
 
RampDeploy() - Method in class frc.robot.subsystems.IntakeRamp.Ramp
Starts the Ramp motor to deploy
RampRetract() - Method in class frc.robot.subsystems.IntakeRamp.Ramp
Starts the Ramp motor to retract.
RawDetection - Class in io.github.roboblazers7617.limelight.targets.neural
Represents a Limelight Raw Neural Detector result from Limelight's NetworkTables output.
RawDetection(int, double, double, double, double, double, double, double, double, double, double, double) - Constructor for class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
rawFiducials - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
RawFiducialTarget - Class in io.github.roboblazers7617.limelight.targets
Represents a Limelight Raw Fiducial result from Limelight's NetworkTables output.
RawFiducialTarget(int, double, double, double, double, double, double) - Constructor for class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
RED - Enum constant in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
(Not Recommended) The robot's pose in the WPILib Red Alliance Coordinate System.
RED_MEGATAG2 - Enum constant in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
(Not Recommended) The robot's pose in the WPILib Red Alliance Coordinate System with MegaTag2.
RED_TAG_ID_FILTER - Static variable in class frc.robot.Constants.VisionConstants
The LimelightSettings.withArilTagIdFilter(List) to use on the Red alliance.
Reef() - Constructor for class frc.robot.Constants.FieldConstants.Reef
 
RelativeEncoderLogger - Class in frc.robot.loggers.revlib
Custom logger for RelativeEncoders.
RelativeEncoderLogger() - Constructor for class frc.robot.loggers.revlib.RelativeEncoderLogger
Creates a new RelativeEncoderLogger.
resetLastAngleScalar() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Method to reset what the heading control will turn to if no angle is inputed.
resetLastAngleScalarCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to reset what the heading control will turn to if no angle is inputed.
resetOdometry(Pose2d) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Resets odometry to the given pose.
resetSpeedMultiplier() - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
Sets the controller speed multiplier back to Constants.DrivetrainConstants.TRANSLATION_SCALE_NORMAL.
RetroreflectiveTarget - Class in io.github.roboblazers7617.limelight.targets
Represents a Color/Retroreflective Target Result extracted from JSON Output
RetroreflectiveTarget() - Constructor for class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
RIGHT_MOTOR_ID - Static variable in class frc.robot.Constants.ElevatorConstants
CAN ID for the right elevator motor.
Robot - Class in frc.robot
The methods in this class are called automatically corresponding to each mode, as described in the TimedRobot documentation.
Robot() - Constructor for class frc.robot.Robot
This function is run when the robot is first started up and should be used for any initialization code.
ROBOT_RELATIVE - Enum constant in enum class frc.robot.subsystems.drivetrain.Drivetrain.TranslationOrientation
Translation relative to thd robot rotation.
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.
robotPeriodic() - Method in class frc.robot.Robot
This function is called every 20 ms, no matter the mode.
ROTATION_PID_CONSTANTS - Static variable in class frc.robot.Constants.AutoConstants
PID constants used for rotation.
RunMotorContinuosCommand(Supplier<Double>) - Method in class frc.robot.subsystems.EndEffector.EndEffector
run the motor at the specified speed, will not finish.
RunOnceDeferred - Class in frc.robot.commands
Runs a runnable on the next run of the CommandScheduler.
RunOnceDeferred(Runnable) - Constructor for class frc.robot.commands.RunOnceDeferred
Creates a new RunOnceDeferred.

S

SAFE_MAX_POSITION - Static variable in class frc.robot.Constants.WristConstants
Maximum safe position while the elevator is raised (so it doesn't collide with the metal thing on top), in degrees.
SAFE_MIN_POSITION - Static variable in class frc.robot.Constants.WristConstants
Minimum safe position while the elevator is lowered, in degrees.
save() - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Push any pending changes to the NetworkTable instance immediately.
SCORING_OFFSET - Static variable in class frc.robot.Constants.FieldConstants.Processor
Offset from the AprilTag from which scoring should happen.
ScoringPoses() - Constructor for class frc.robot.Constants.ScoringPoses
 
SECONDARY_BEAM_BREAK_DIO - Static variable in class frc.robot.Constants.EndEffectorConstants
DIO pin for the secondary beam break.
selectTab(int) - Static method in class frc.robot.util.Elastic
Selects the tab of the dashboard at the given index.
selectTab(String) - Static method in class frc.robot.util.Elastic
Selects the tab of the dashboard with the given name.
sendNotification(Elastic.Notification) - Static method in class frc.robot.util.Elastic
Sends an notification to the Elastic dashboard.
SERVO_DISABLED_ANGLE - Static variable in class frc.robot.Constants.ClimberConstants
Servo angle at which the climber is disengaged.
SERVO_ENABLED_ANGLE - Static variable in class frc.robot.Constants.ClimberConstants
Servo angle at which the climber is engaged.
SERVO_PWM_PORT - Static variable in class frc.robot.Constants.ClimberConstants
PWM port for the climber ratchet servo.
setAutoChooser(SendableChooser<Command>) - Method in class frc.robot.RobotContainer
Set the auto chooser
setChassisSpeeds(ChassisSpeeds) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Set chassis speeds with closed-loop velocity control.
setDescription(String) - Method in class frc.robot.util.Elastic.Notification
Updates the description of this notification
setDisplayTimeMillis(int) - Method in class frc.robot.util.Elastic.Notification
Updates the display time of the notification in milliseconds
setDisplayTimeSeconds(double) - Method in class frc.robot.util.Elastic.Notification
Updates the display time of the notification
setHeight(double) - Method in class frc.robot.util.Elastic.Notification
Updates the height of the notification
setLastAngleScalar(Rotation2d) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Sets the angle that heading control will turn to if no angle is inputed.
setLastAngleScalar(Supplier<Rotation2d>) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Sets the angle that heading control will turn to if no angle is inputed.
setLastAngleScalarCommand(Supplier<Rotation2d>) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to set the angle that heading control will turn to if no angle is inputed.
setLevel(Elastic.Notification.NotificationLevel) - Method in class frc.robot.util.Elastic.Notification
Updates the level of this notification
setMotorBrake(boolean) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Sets the drive motors to brake/coast mode.
SetPositionCommand(Constants.ArmPosition) - Method in class frc.robot.subsystems.Elevator
A command to set the elevator and wrist to a position.
setRobotOrientation(Rotation3d) - Method in class io.github.roboblazers7617.limelight.Limelight
 
setSpeedMultiplier(double) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
Sets the controller speed multiplier.
setSpeedMultiplierCommand(Supplier<Double>) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
Sets the controller speed multiplier.
setSpeedsCommand(DoubleSupplier, DoubleSupplier) - Method in class frc.robot.subsystems.Elevator
A command to set the speeds of the elevator and wrist.
setTagFilterAlliance(DriverStation.Alliance) - Method in class frc.robot.subsystems.vision.Vision
Sets the AprilTag ID filter to the appropriate set for the given alliance.
settings - Variable in class io.github.roboblazers7617.limelight.Limelight
 
setTitle(String) - Method in class frc.robot.util.Elastic.Notification
Updates the title of this notification
setupPathPlanner(Drivetrain, DriverStation.Alliance) - Static method in class frc.robot.subsystems.Auto
Setup AutoBuilder for PathPlanner.
setupPathPlannerFailsafe(Drivetrain) - Static method in class frc.robot.subsystems.Auto
Configures AutoBuilder if it hasn't already been configured.
setWidth(double) - Method in class frc.robot.util.Elastic.Notification
Updates the width of the notification
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.Drivetrain
 
snapshot(String) - Method in class io.github.roboblazers7617.limelight.Limelight
Asynchronously take snapshot.
SparkBaseLogger - Class in frc.robot.loggers.revlib
Custom logger for SparkBase.
SparkBaseLogger() - Constructor for class frc.robot.loggers.revlib.SparkBaseLogger
Creates a new SparkBaseLogger.
SparkFaultsStruct - Class in frc.robot.loggers.revlib.structs
Struct to represent the data in SparkBase.Faults.
SparkFaultsStruct() - Constructor for class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
SparkLimitSwitchLogger - Class in frc.robot.loggers.revlib
Custom logger for SparkLimitSwitches.
SparkLimitSwitchLogger() - Constructor for class frc.robot.loggers.revlib.SparkLimitSwitchLogger
Creates a new SparkLimitSwitchLogger.
SparkWarningsStruct - Class in frc.robot.loggers.revlib.structs
Struct to represent the data in SparkBase.Warnings.
SparkWarningsStruct() - Constructor for class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
Standard - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.StreamMode
Side by side.
STARTING_POSITION - Static variable in class frc.robot.Constants.DrivetrainConstants
Starting pose.
StartMotorCommand(Supplier<Double>) - Method in class frc.robot.subsystems.EndEffector.EndEffector
Starts the intake motor.
StopIntakeMotor() - Method in class frc.robot.subsystems.EndEffector.EndEffector
Stops the intake motor.
STOW - Enum constant in enum class frc.robot.Constants.ArmPosition
wrist up and elevator down
STOW_ALGAE - Enum constant in enum class frc.robot.Constants.ArmPosition
elevator at bottom, wrist open so we don't crush the algae into the robot
SyncInternalImu - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Use external IMU yaw submitted via Limelight.setRobotOrientation(edu.wpi.first.math.geometry.Rotation3d) for MT2 localization.
SysId() - Constructor for class frc.robot.Constants.DrivetrainConstants.SysId
 
sysIdAngleMotorCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to characterize the robot angle motors using SysId.
sysIdDriveMotorCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Command to characterize the robot drive motors using SysId.

T

ta - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
ta - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
ta - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
ta - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
ta - Variable in class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
ta - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
TAG_ID - Static variable in class frc.robot.Constants.FieldConstants.Processor
AprilTag ID for the processor on the blue alliance.
TAG_IDS - Static variable in class frc.robot.Constants.FieldConstants.Reef
AprilTag IDs for the reef on the blue alliance.
TAG_POSE - Static variable in class frc.robot.Constants.FieldConstants.Processor
AprilTag pose for the processor on the blue alliance.
TAG_POSES - Static variable in class frc.robot.Constants.FieldConstants.Reef
AprilTag poses for the reef on the blue alliance.
tagCount - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
tagSpan - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
targets_Barcode - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
targets_Classifier - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
targets_Detector - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
targets_Fiducials - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
targets_Retro - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
TELEMETRY_VERBOSITY_DEBUG - Static variable in class frc.robot.Constants.DrivetrainConstants
YAGSL telemetry verbosity when in debug mode.
TELEMETRY_VERBOSITY_NORMAL - Static variable in class frc.robot.Constants.DrivetrainConstants
YAGSL telemetry verbosity when in normal mode.
TELEOP_TAB_NAME - Static variable in class frc.robot.Constants.DashboardConstants
The name of the tab used in Teleop.
teleopInit() - Method in class frc.robot.Robot
 
teleopInit() - Method in class frc.robot.RobotContainer
This method is run at the start of Teleop.
teleopPeriodic() - Method in class frc.robot.Robot
This function is called periodically during operator control.
TEST_WITH_SPINNING - Static variable in class frc.robot.Constants.DrivetrainConstants.SysId
Spin in place instead of driving forward.
testInit() - Method in class frc.robot.Robot
 
testPeriodic() - Method in class frc.robot.Robot
This function is called periodically during test mode.
timestamp_LIMELIGHT_publish - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
timestamp_RIOFPGA_capture - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
timestampSeconds - Variable in class io.github.roboblazers7617.limelight.PoseEstimate
 
TOLERANCE - Static variable in class frc.robot.Constants.ElevatorConstants
Tolerance for the target to be considered reached in meters.
TOLERANCE - Static variable in class frc.robot.Constants.WristConstants
Tolerance for the target to be considered reached in degrees.
toPose2D(double[]) - Static method in class io.github.roboblazers7617.limelight.JsonUtilities
Takes a 6-length array of pose data and converts it to a Pose2d object.
toPose3D(double[]) - Static method in class io.github.roboblazers7617.limelight.JsonUtilities
Takes a 6-length array of pose data and converts it to a Pose3d object.
TRANSLATION_PID_CONSTANTS - Static variable in class frc.robot.Constants.AutoConstants
PID constants used for translation.
TRANSLATION_SCALE_FAST - Static variable in class frc.robot.Constants.DrivetrainConstants
Translation axis scaling.
TRANSLATION_SCALE_NORMAL - Static variable in class frc.robot.Constants.DrivetrainConstants
Translation axis scaling.
TRANSLATION_SCALE_SLIDE - Static variable in class frc.robot.Constants.DrivetrainConstants
Translation axis scaling.
TRANSLATION_SCALE_SLOW - Static variable in class frc.robot.Constants.DrivetrainConstants
Translation axis scaling.
translation3dToArray(Translation3d) - Static method in class io.github.roboblazers7617.limelight.JsonUtilities
Converts a Translation3d object to an array of doubles in format [x, y, z].
TrapezoidProfileStateLogger - Class in frc.robot.loggers
 
TrapezoidProfileStateLogger() - Constructor for class frc.robot.loggers.TrapezoidProfileStateLogger
 
TripleDownscale - Enum constant in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Triple downscaling, equivalent to 3
ts - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
ts - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
tx - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
tx - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
tx - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
tx - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
tx - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
tx_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
tx_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
tx_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
tx_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
tx_pixels - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
tx_pixels - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
tx_pixels - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
tx_pixels - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
tx_pixels - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
txnc - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
txnc - Variable in class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 
ty - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
ty - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
ty - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
ty - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
ty - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
ty_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
ty_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
ty_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
ty_nocrosshair - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
ty_pixels - Variable in class io.github.roboblazers7617.limelight.targets.BarcodeTarget
 
ty_pixels - Variable in class io.github.roboblazers7617.limelight.targets.FiducialTarget
 
ty_pixels - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
ty_pixels - Variable in class io.github.roboblazers7617.limelight.targets.neural.DetectorTarget
 
ty_pixels - Variable in class io.github.roboblazers7617.limelight.targets.RetroreflectiveTarget
 
tync - Variable in class io.github.roboblazers7617.limelight.targets.neural.RawDetection
 
tync - Variable in class io.github.roboblazers7617.limelight.targets.RawFiducialTarget
 

U

unpack(ByteBuffer) - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
 
unpack(ByteBuffer) - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
 
update(EpilogueBackend, AbsoluteEncoder) - Method in class frc.robot.loggers.revlib.AbsoluteEncoderLogger
 
update(EpilogueBackend, RelativeEncoder) - Method in class frc.robot.loggers.revlib.RelativeEncoderLogger
 
update(EpilogueBackend, SparkBase) - Method in class frc.robot.loggers.revlib.SparkBaseLogger
 
update(EpilogueBackend, SparkLimitSwitch) - Method in class frc.robot.loggers.revlib.SparkLimitSwitchLogger
 
update(EpilogueBackend, TrapezoidProfile.State) - Method in class frc.robot.loggers.TrapezoidProfileStateLogger
 
updatePoseEstimation() - Method in class frc.robot.subsystems.vision.Vision
Update the pose estimation inside of Vision.swerveDrive with data from Limelight.
USE_IN_AUTO - Static variable in class frc.robot.Constants.DrivetrainConstants.AngularVelocityCompensation
Enables angular velocity correction in autonomous.
USE_IN_TELEOP - Static variable in class frc.robot.Constants.DrivetrainConstants.AngularVelocityCompensation
Enables angular velocity correction in teleop.
Util - Class in frc.robot.util
General utilities.
Util() - Constructor for class frc.robot.util.Util
 

V

valid - Variable in class io.github.roboblazers7617.limelight.PipelineResult
 
validPoseEstimate(PoseEstimate) - Method in class io.github.roboblazers7617.limelight.PoseEstimator
 
valueOf(String) - Static method in enum class frc.robot.Constants.ArmPosition
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class frc.robot.Constants.OperatorConstants.GamepieceMode
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class frc.robot.subsystems.drivetrain.Drivetrain.TranslationOrientation
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class frc.robot.util.Elastic.Notification.NotificationLevel
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.LEDMode
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.StreamMode
Returns the enum constant of this class with the specified name.
valueOf(String) - Static method in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
Returns the enum constant of this class with the specified name.
values() - Static method in enum class frc.robot.Constants.ArmPosition
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class frc.robot.Constants.OperatorConstants.GamepieceMode
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class frc.robot.subsystems.drivetrain.Drivetrain.TranslationOrientation
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.Elastic.Notification.NotificationLevel
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.DownscalingOverride
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.ImuMode
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.LEDMode
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class io.github.roboblazers7617.limelight.LimelightSettings.StreamMode
Returns an array containing the constants of this enum class, in the order they are declared.
values() - Static method in enum class io.github.roboblazers7617.limelight.PoseEstimator.PoseEstimators
Returns an array containing the constants of this enum class, in the order they are declared.
VELOCITY_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.ElevatorConstants
Conversion factor from rotation to meters per second.
VELOCITY_CONVERSION_FACTOR - Static variable in class frc.robot.Constants.WristConstants
Conversion factor from rotation to degrees per second.
VERSION - Static variable in class frc.robot.VersionConstants
Robot code version.
VersionConstants - Class in frc.robot
Constants that contain version metadata for the robot.
VersionConstants() - Constructor for class frc.robot.VersionConstants
 
Vision - Class in frc.robot.subsystems.vision
Class that handles vision logic.
Vision(SwerveDrive) - Constructor for class frc.robot.subsystems.vision.Vision
Creates a new Vision.
VisionConstants() - Constructor for class frc.robot.Constants.VisionConstants
 

W

WaitUntilInterrupt - Class in frc.robot.commands
Command that creates an AsynchronousInterrupt and uses it to trigger a callback, waiting until the callback happens before finishing.
WaitUntilInterrupt(DigitalSource, BiConsumer<Boolean, Boolean>) - Constructor for class frc.robot.commands.WaitUntilInterrupt
Creates a new WaitUntilInterrupt command that finishes when the interrupt is triggered.
WaitUntilInterrupt(DigitalSource, BiConsumer<Boolean, Boolean>, boolean, boolean) - Constructor for class frc.robot.commands.WaitUntilInterrupt
Creates a new WaitUntilInterrupt command that finishes when the interrupt is triggered.
WARNING - Enum constant in enum class frc.robot.util.Elastic.Notification.NotificationLevel
Warning message
withAprilTagOffset(Translation3d) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the offset from the AprilTag that is of interest.
withArilTagIdFilter(List<Double>) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the Limelight AprilTagID filter/override of which to track.
withAutomaticHeight() - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's height and returns itself to allow for method chaining
withCameraOffset(Pose3d) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the Limelight offset.
withCropWindow(double, double, double, double) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Sets the crop window for the camera.
withDescription(String) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's description and returns itself to allow for method chaining
withDisplayMilliseconds(int) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's display time and returns itself to allow for method chaining
withDisplaySeconds(double) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's display time and returns itself to allow for method chaining
withFiducialDownscalingOverride(LimelightSettings.DownscalingOverride) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Sets the downscaling factor for AprilTag detection.
withHeight(double) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's height and returns itself to allow for method chaining
withImuAssistAlpha(double) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the IMU's alpha value for its complementary filter while in one of the LimelightSettings.ImuMode's assist modes.
withImuMode(LimelightSettings.ImuMode) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the IMU Mode based on the LimelightSettings.ImuMode enum.
withLevel(Elastic.Notification.NotificationLevel) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's level and returns itself to allow for method chaining
withLimelightLEDMode(LimelightSettings.LEDMode) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
withNoAutoDismiss() - Method in class frc.robot.util.Elastic.Notification
Modifies the notification to disable the auto dismiss behavior
withPipelineIndex(int) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the current pipeline index for the Limelight
withPriorityTagId(int) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the Priority Tag ID for Limelight
withProcessedFrameFrequency(int) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Sets the number of frames to skip between processing the contents of a frame.
withStreamMode(LimelightSettings.StreamMode) - Method in class io.github.roboblazers7617.limelight.LimelightSettings
Set the Stream mode based on the LimelightSettings.StreamMode enum
withTitle(String) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's title and returns itself to allow for method chaining
withWidth(double) - Method in class frc.robot.util.Elastic.Notification
Modifies the notification's width and returns itself to allow for method chaining
WRIST_POSITION - Variable in enum class frc.robot.Constants.ArmPosition
The wrist position in degrees.
WristConstants() - Constructor for class frc.robot.Constants.WristConstants
 

Z

ZERO_OFFSET - Static variable in class frc.robot.Constants.ElevatorConstants
Zero offset, meters.
ZERO_OFFSET - Static variable in class frc.robot.Constants.WristConstants
Zero offset, in rotations, because reasons.
zeroGyro() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Resets the gyro angle to zero and resets odometry to the same position, but facing toward 0.
zeroGyroCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Resets the gyro angle to zero and resets odometry to the same position, but facing toward 0.
zeroGyroWithAlliance() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
This will zero (calibrate) the robot to assume the current position is facing forward
zeroGyroWithAllianceCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
Resets the gyro angle to zero and resets odometry to the same position, but facing toward 0.
zone - Variable in class io.github.roboblazers7617.limelight.targets.neural.ClassifierTarget
 
A B C D E F G H I J K L M N O P Q R S T U V W Z 
All Classes and Interfaces|All Packages|Constant Field Values