Index
All Classes and Interfaces|All Packages|Constant Field Values
A
- AbsoluteEncoderLogger - Class in frc.robot.loggers.revlib
-
Custom logger for AbsoluteEncoders.
- AbsoluteEncoderLogger() - Constructor for class frc.robot.loggers.revlib.AbsoluteEncoderLogger
-
Creates a new AbsoluteEncoderLogger.
- ALIGMNMENT_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
-
The speed at which the intake spins to align notes for shooting.
- 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
- Arm - Class in frc.robot.subsystems.mechanisms.arm
-
A superstructure to control both the Elevator and Pivot.
- Arm() - Constructor for class frc.robot.subsystems.mechanisms.arm.Arm
-
Creates a new Arm subsystem using a new Elevator and Pivot.
- Arm(Elevator, Pivot) - Constructor for class frc.robot.subsystems.mechanisms.arm.Arm
-
Creates a new Arm subsystem using the provided Elevator and Pivot.
- ArmPosition - Class in frc.robot.subsystems.mechanisms.arm
-
Class that represents a position of the Arm, including both Elevator and Pivot positions.
- ArmPosition(Distance, Angle) - Constructor for class frc.robot.subsystems.mechanisms.arm.ArmPosition
-
A combined elevator and pivot position.
- ArmPositions() - Constructor for class frc.robot.Constants.ArmPositions
- 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.
- 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.
B
- BACK_LIMELIGHT_NAME - Static variable in class frc.robot.Constants.VisionConstants
-
The name of the back Limelight on NetworkTables.
- BLUE_TAG_ID_FILTER - Static variable in class frc.robot.Constants.VisionConstants
-
The AprilTag IDs to use on the blue alliance.
- 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
- centerModulesCommand() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
-
Command to center the modules of the SwerveDrive subsystem.
- CONFIG_DIR - Static variable in class frc.robot.Constants.DrivetrainConstants
-
Directory that contains the YAGSL configuration.
- 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.ArmPositions - Class in frc.robot
-
Position presets for the Arm.
- Constants.AutoConstants - Class in frc.robot
-
Constants used to configure the autonomous program.
- 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.FieldConstants - Class in frc.robot
-
Constants that describe the physical layout of the field.
- Constants.IntakeConstants - Class in frc.robot
-
Constants used by the
Head
's intake. - 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.PivotConstants - Class in frc.robot
-
Constants used to configure the pivot.
- Constants.ShooterConstants - Class in frc.robot
-
Constants used by the
Head
's shooter. - Constants.VisionConstants - Class in frc.robot
-
Constants used to configure vision.
- CURRENT_LIMIT - Static variable in class frc.robot.Constants.ElevatorConstants
-
Current limit in amps.
- CURRENT_LIMIT - Static variable in class frc.robot.Constants.IntakeConstants
-
Motor current limit in amps.
- CURRENT_LIMIT - Static variable in class frc.robot.Constants.PivotConstants
-
Current limit in amps.
- CURRENT_LIMIT - Static variable in class frc.robot.Constants.ShooterConstants
-
Motor current limit in amps.
D
- DashboardConstants() - Constructor for class frc.robot.Constants.DashboardConstants
- 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.
- 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
- doNothing() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
A command that does nothing.
- doNothing() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
A command that does nothing.
- 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 usesDrivetrainControls.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 usesDrivetrainControls.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 usesDrivetrainControls.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 usesDrivetrainControls.driveStaticHeading(CommandXboxController, Supplier)
. - driveStaticHeadingNearestPoseCommand(CommandXboxController, Drivetrain.TranslationOrientation, List<Pose2d>) - Method in class frc.robot.subsystems.drivetrain.DrivetrainControls
-
DrivetrainControls.driveStaticHeadingCommand(CommandXboxController, TranslationOrientation, Supplier)
that uses the heading of the nearest pose from a list of poses. - 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.mechanisms.arm
-
Subsystem to control the elevator.
- Elevator() - Constructor for class frc.robot.subsystems.mechanisms.arm.Elevator
-
Creates a new Elevator.
- ElevatorConstants() - Constructor for class frc.robot.Constants.ElevatorConstants
- elevatorPosition - Variable in class frc.robot.subsystems.mechanisms.arm.ArmPosition
-
The elevator position, as a distance from the fully retracted position.
- ENABLE_COSINE_COMPENSATION - Static variable in class frc.robot.Constants.DrivetrainConstants
-
Enables
cosine compensation
. - ENABLE_HEADING_CORRECTION - Static variable in class frc.robot.Constants.DrivetrainConstants
-
Enables
heading correction
. - ENABLE_VISION - Static variable in class frc.robot.Constants.VisionConstants
-
Enable vision odometry updates.
- enableBrakeModeCommand() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
Enables brake mode on the elevator motors.
- enableBrakeModeCommand() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
Enables brake mode on the pivot motor.
- enableBrakeModeCommand() - Method in class frc.robot.subsystems.mechanisms.Head
-
Enables brake mode on the intake motor.
- 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
- 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
F
- FEEDER_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
-
The speed at which the intake spins to feed notes into the shooter.
- 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.
- frc.robot - package frc.robot
-
A complete, stately rewrite of FRC Team 7617's 2024 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 theDrivetrain
. - 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.mechanisms - package frc.robot.subsystems.mechanisms
-
Classes that control the robot's mechanisms.
- frc.robot.subsystems.mechanisms.arm - package frc.robot.subsystems.mechanisms.arm
-
Classes to control the pivot and elevator.
- 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
- 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.
- getDescription() - Method in class frc.robot.util.Elastic.Notification
- getDisplayTimeMillis() - Method in class frc.robot.util.Elastic.Notification
-
Gets the display time of the notification in milliseconds
- getElevatorPosition() - Method in class frc.robot.subsystems.mechanisms.arm.ArmPosition
-
Gets the
ArmPosition.elevatorPosition
. - getFieldVelocity() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
-
Gets the current field-relative velocity (x, y and omega) of the robot.
- 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
- getKinematics() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
-
Get the swerve drive kinematics object.
- getLevel() - Method in class frc.robot.util.Elastic.Notification
- getPitch() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
-
Gets the current pitch angle of the robot, as reported by the imu.
- getPivotAngle() - Method in class frc.robot.subsystems.mechanisms.arm.ArmPosition
-
Gets the
ArmPosition.pivotAngle
. - getPose() - Method in class frc.robot.subsystems.drivetrain.Drivetrain
-
Gets the current pose (position and rotation) of the robot, as reported by odometry.
- getPosition() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
Gets the current position of the elevator.
- getPosition() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
Gets the current position of the pivot.
- 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
- getShooterSetPoint() - Method in class frc.robot.subsystems.mechanisms.Head
-
Gets the current setpoint of the shooter.
- getShooterSpeed() - Method in class frc.robot.subsystems.mechanisms.Head
-
Gets the speed of the bottom shooter motor.
- 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. - getTarget() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
Gets the current
Elevator.target
. - getTarget() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
Gets the current
Pivot.target
. - getTitle() - Method in class frc.robot.util.Elastic.Notification
-
Gets the title of this notification
- 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
- Head - Class in frc.robot.subsystems.mechanisms
-
Shooter and intake.
- Head() - Constructor for class frc.robot.subsystems.mechanisms.Head
-
Creates a new Head.
- HEAD_CLEAR_POSITION - Static variable in class frc.robot.Constants.ElevatorConstants
-
Position at which the head clears the robot chassis, in meters.
I
- INFO - Enum constant in enum class frc.robot.util.Elastic.Notification.NotificationLevel
-
Informational Message
- init() - Method in class frc.robot.RobotContainer
-
This method is run when enabling into any mode.
- init() - Method in class frc.robot.subsystems.mechanisms.arm.Arm
-
Initializes the
Arm.elevator
andArm.pivot
. - init() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
Sets up the elevator.
- init() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
Sets up the pivot.
- 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_FLOOR - Static variable in class frc.robot.Constants.ArmPositions
-
A position used to pick up notes from the floor.
- INTAKE_SOURCE - Static variable in class frc.robot.Constants.ArmPositions
-
A position used to pick up notes from the source.
- INTAKE_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
-
The speed at which the intake spins to intake notes.
- IntakeConstants() - Constructor for class frc.robot.Constants.IntakeConstants
- intakePieceCommand() - Method in class frc.robot.subsystems.mechanisms.Head
-
Intakes a piece and stops.
- isAtTarget() - Method in class frc.robot.subsystems.mechanisms.arm.Arm
-
Checks if the
Arm.elevator
andArm.pivot
are at their target positions. - isAtTarget() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
Check if the elevator is within the tolerance to it's target position.
- isAtTarget() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
Check if the pivot is within the tolerance to it's target position.
- 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
- isImmutable() - Method in class frc.robot.loggers.revlib.structs.SparkFaultsStruct
- isImmutable() - Method in class frc.robot.loggers.revlib.structs.SparkWarningsStruct
- isNoteWithinAlignmentSensor() - Method in class frc.robot.subsystems.mechanisms.Head
-
Gets the value of the alignment sensor.
- isNoteWithinShootingSensor() - Method in class frc.robot.subsystems.mechanisms.Head
-
Gets the value of the shooting position sensor.
- isReadyToShoot() - Method in class frc.robot.subsystems.mechanisms.Head
-
Checks if the shooter speed is within the range to shoot.
- isRedAlliance() - Static method in class frc.robot.util.Util
-
Checks if the alliance is red, defaults to false if alliance isn't available.
K
- KD - Static variable in class frc.robot.Constants.ElevatorConstants
-
Elevator kD.
- KD - Static variable in class frc.robot.Constants.PivotConstants
-
Pivot kD.
- KD - Static variable in class frc.robot.Constants.ShooterConstants
-
Shooter kD.
- KF - Static variable in class frc.robot.Constants.ShooterConstants
-
Shooter kF.
- KG - Static variable in class frc.robot.Constants.ElevatorConstants
-
Elevator kG.
- KG - Static variable in class frc.robot.Constants.PivotConstants
-
Pivot kG.
- KI - Static variable in class frc.robot.Constants.ElevatorConstants
-
Elevator kI.
- KI - Static variable in class frc.robot.Constants.PivotConstants
-
Pivot kI.
- KI - Static variable in class frc.robot.Constants.ShooterConstants
-
Shooter 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.PivotConstants
-
Pivot kMaxOutput.
- KMAX_OUTPUT - Static variable in class frc.robot.Constants.ShooterConstants
-
Shooter 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.PivotConstants
-
Pivot kMinOutput.
- KMIN_OUTPUT - Static variable in class frc.robot.Constants.ShooterConstants
-
Shooter kMinOutput.
- KP - Static variable in class frc.robot.Constants.ElevatorConstants
-
Elevator kP.
- KP - Static variable in class frc.robot.Constants.PivotConstants
-
Pivot kP.
- KP - Static variable in class frc.robot.Constants.ShooterConstants
-
Shooter kP.
- KS - Static variable in class frc.robot.Constants.ElevatorConstants
-
Elevator kS.
- KS - Static variable in class frc.robot.Constants.PivotConstants
-
Pivot kS.
- KV - Static variable in class frc.robot.Constants.ElevatorConstants
-
Elevator kV.
- KV - Static variable in class frc.robot.Constants.PivotConstants
-
Pivot kV.
L
- LEFT_MOTOR_ID - Static variable in class frc.robot.Constants.ElevatorConstants
-
CAN ID for the left elevator motor.
- 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
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.
- 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.PivotConstants
-
Maximum acceleration in degrees/s^2.
- MAX_ANGULAR_ACCELERATION - Static variable in class frc.robot.Constants.DrivetrainConstants.Pathfinding
-
Maximum angular acceleration.
- MAX_LINEAR_ACCELERATION - Static variable in class frc.robot.Constants.DrivetrainConstants.Pathfinding
-
Maximium linear acceleration.
- MAX_POSITION - Static variable in class frc.robot.Constants.ElevatorConstants
-
Maximum position in meters.
- MAX_POSITION - Static variable in class frc.robot.Constants.PivotConstants
-
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.PivotConstants
-
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.PivotConstants
-
Minimum position when the elevator is not lowered, in degrees.
- MOTOR_ID - Static variable in class frc.robot.Constants.IntakeConstants
-
The CAN ID for the intake motor.
- MOTOR_ID - Static variable in class frc.robot.Constants.PivotConstants
-
Motor CAN ID.
- MOTOR_ID_BOTTOM - Static variable in class frc.robot.Constants.ShooterConstants
-
CAN ID for the bottom shooter motor.
- MOTOR_ID_TOP - Static variable in class frc.robot.Constants.ShooterConstants
-
CAN ID for the top shooter motor.
N
- NOTE_ALIGNMENT_SENSOR_DIO - Static variable in class frc.robot.Constants.IntakeConstants
-
The DIO pin for the beam break that senses when a note is in the position to shoot.
- NOTE_SENSOR_DIO - Static variable in class frc.robot.Constants.IntakeConstants
-
The DIO pin for the beam break that senses when a note has entered the intake.
- 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_SPEED - Static variable in class frc.robot.Constants.IntakeConstants
-
The speed at which the intake spins to outtake notes.
- outtakePieceCommand() - Method in class frc.robot.subsystems.mechanisms.Head
-
Outtakes a piece and stops.
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.mechanisms.arm.Arm
-
This method is responsible for ensuring safe interactions between the head and the chassis of the robot.
- periodic() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
This method is responsible for they safety of the elevator.
- periodic() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
This method is responsible for they safety of the pivot.
- periodic() - Method in class frc.robot.subsystems.mechanisms.Head
- Pivot - Class in frc.robot.subsystems.mechanisms.arm
-
Subsystem used to control the elevator pivot.
- Pivot() - Constructor for class frc.robot.subsystems.mechanisms.arm.Pivot
-
Creates a new Pivot.
- pivotAngle - Variable in class frc.robot.subsystems.mechanisms.arm.ArmPosition
-
The pivot angle, as an angle from the field (90 degrees is straight up).
- PivotConstants() - Constructor for class frc.robot.Constants.PivotConstants
- POSE_ESTIMATOR_TYPE - Static variable in class frc.robot.Constants.VisionConstants
-
Use MegaTag2 for pose estimation.
- 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.PivotConstants
-
Conversion factor from rotation to degrees.
- postTrajectory(Trajectory) - Method in class frc.robot.subsystems.drivetrain.Drivetrain
-
Post the trajectory to the field.
- publishNetworkTables(NetworkTable) - Static method in class frc.robot.VersionConstants
-
Publish version metadata to a NetworkTable.
Q
- QUASI_TIMEOUT - Static variable in class frc.robot.Constants.DrivetrainConstants.SysId
-
Time in seconds to run Quasistatic routines.
R
- RED_TAG_ID_FILTER - Static variable in class frc.robot.Constants.VisionConstants
-
The AprilTag IDs to use on the Red alliance.
- 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
. - 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.
- 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_MIN_POSITION - Static variable in class frc.robot.Constants.PivotConstants
-
Minimum safe position while the elevator is below
Constants.ElevatorConstants.HEAD_CLEAR_POSITION
, in degrees. - 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.
- 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(ArmPosition) - Method in class frc.robot.subsystems.mechanisms.arm.Arm
-
A command to set the elevator and wrist to a position.
- setSpeedCommand(DoubleSupplier) - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
A command to set the speed of the elevator.
- setSpeedCommand(DoubleSupplier) - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
A command to set the speed of the pivot.
- 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.
- setTagFilterAlliance(DriverStation.Alliance) - Method in class frc.robot.subsystems.vision.Vision
-
Sets the AprilTag ID filter to the appropriate set for the given alliance.
- setTarget(double) - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
A method to move the elevator to a position in meters.
- setTarget(double) - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
A function to move the pivot to a position in degrees.
- setTarget(Angle) - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
A method to move the pivot to a position.
- setTarget(Distance) - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
A method to move the elevator to a position.
- 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
- shootCommand() - Method in class frc.robot.subsystems.mechanisms.Head
-
Shoots.
- ShooterConstants() - Constructor for class frc.robot.Constants.ShooterConstants
- 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
- 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
- spinDownShooter() - Method in class frc.robot.subsystems.mechanisms.Head
-
Stops the shooter.
- spinDownShooterCommand() - Method in class frc.robot.subsystems.mechanisms.Head
-
Spins down the shooter.
- spinUpShooterCommand(double) - Method in class frc.robot.subsystems.mechanisms.Head
-
Spins up the shooter to a given speed.
- STARTING_POSITION - Static variable in class frc.robot.Constants.DrivetrainConstants
-
Starting pose.
- STOW - Static variable in class frc.robot.Constants.ArmPositions
-
A neutral position with the pivot low and the elevator retracted.
- 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
- 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.
- toggleBrakeModeCommand() - Method in class frc.robot.subsystems.mechanisms.arm.Elevator
-
Toggles brake mode on the elevator motors.
- toggleBrakeModeCommand() - Method in class frc.robot.subsystems.mechanisms.arm.Pivot
-
Toggles brake mode on the pivot motor.
- toggleBrakeModeCommand() - Method in class frc.robot.subsystems.mechanisms.Head
-
Toggles brake mode on the intake motor.
- toggleBrakeModesCommand() - Method in class frc.robot.subsystems.mechanisms.arm.Arm
- 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.PivotConstants
-
Tolerance for the target to be considered reached in degrees.
- 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.
- TrapezoidProfileStateLogger - Class in frc.robot.loggers
- TrapezoidProfileStateLogger() - Constructor for class frc.robot.loggers.TrapezoidProfileStateLogger
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
- 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.
- 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.
- 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.PivotConstants
-
Conversion factor from rotation to degrees per second.
- VELOCITY_TOLERANCE - Static variable in class frc.robot.Constants.ShooterConstants
-
How close does the shooter have to be to its target velocity before it's considered to be at speed?
- 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
- withAutomaticHeight() - Method in class frc.robot.util.Elastic.Notification
-
Modifies the notification's height and returns itself to allow for method chaining
- 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
- withHeight(double) - Method in class frc.robot.util.Elastic.Notification
-
Modifies the notification's height and returns itself to allow for method chaining
- 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
- withNoAutoDismiss() - Method in class frc.robot.util.Elastic.Notification
-
Modifies the notification to disable the auto dismiss behavior
- 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
Z
- ZERO_OFFSET - Static variable in class frc.robot.Constants.ElevatorConstants
-
Zero offset, meters.
- ZERO_OFFSET - Static variable in class frc.robot.Constants.PivotConstants
-
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.
All Classes and Interfaces|All Packages|Constant Field Values