Skip navigation links
A B C D E F G H I J K L M N O P Q R S T U V W X Y Z 

G

GEAR_RATIO - Static variable in class frc.team670.robot.subsystems.Climber
 
generatePath() - Method in class frc.team670.robot.commands.drive.purePursuit.PathGenerator
Generates a not-reversed path
generatePath(boolean) - Method in class frc.team670.robot.commands.drive.purePursuit.PathGenerator
 
getAButton() - Method in class frc.team670.robot.utils.MustangController
 
getAdjustedBackUltrasonicDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getAngle() - Method in class frc.team670.robot.dataCollection.MustangSensors
Gets fieldcentric angle of navX
getAngle() - Method in class frc.team670.robot.dataCollection.sensors.NavX
 
getAngle(Translation2d, Translation2d) - Static method in class frc.team670.robot.utils.math.Translation2d
 
getAngleInDegrees() - Method in class frc.team670.robot.subsystems.elbow.Elbow
 
getAngleInDegrees() - Method in interface frc.team670.robot.subsystems.elbow.ElbowInterface
 
getAngleInDegrees() - Method in class frc.team670.robot.subsystems.Intake
 
getAngleInDegrees() - Method in class frc.team670.robot.subsystems.RotatingSubsystem
 
getAngleInDegrees() - Method in class frc.team670.robot.subsystems.wrist.Wrist
 
getAngleInDegrees() - Method in interface frc.team670.robot.subsystems.wrist.WristInterface
 
getAngleToTarget() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getAngleToWallTarget() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor
 
getArbitraryFeedForwardAngleMultiplier() - Method in class frc.team670.robot.subsystems.extension.BaseExtension
 
getArbitraryFeedForwardAngleMultiplier() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getArbitraryFeedForwardAngleMultiplier() - Method in class frc.team670.robot.subsystems.Intake
 
getArbitraryFeedForwardAngleMultiplier() - Method in class frc.team670.robot.subsystems.wrist.Wrist
 
getArmState(Arm.LegalState) - Static method in class frc.team670.robot.subsystems.Arm
Gets the ArmState object that corresponds to the LegalState Ex.
getAutonCommand() - Method in class frc.team670.robot.dataCollection.XKeys
 
getBackButton() - Method in class frc.team670.robot.utils.MustangController
 
getBackControllerOnTarget() - Method in class frc.team670.robot.subsystems.Climber
Returns true if the back controller is on target and false if not
getBackLeftUltrasonicDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getBackLeftUltrasonicUnadjustedDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getBackPistonsRetracted() - Method in class frc.team670.robot.subsystems.Climber
Returns whether or not the command for retracting the back pistons has been called and finished
getBackPistonsRetractionInProgress() - Method in class frc.team670.robot.subsystems.Climber
Returns whether or not the command for retracting the back pistons has been called and is in progress
getBackRightUltrasonicDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getBackRightUltrasonicUnadjustedDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getBackTalonPositionInInches() - Method in class frc.team670.robot.subsystems.Climber
Returns the position of the back pistons in inches
getBackTalonPositionInTicks() - Method in class frc.team670.robot.subsystems.Climber
Returns the position of the back pistons in ticks
getBButton() - Method in class frc.team670.robot.utils.MustangController
 
getCameraDirection() - Static method in class frc.team670.robot.commands.cameras.FlipCamera
Driver camera direction (true = front, false = back).
getClaw() - Method in class frc.team670.robot.subsystems.Arm
 
getCommand() - Method in class frc.team670.robot.commands.arm.armTransitions.ArmTransition
 
getCommand() - Method in class frc.team670.robot.commands.arm.armTransitions.CommonTransition
 
getCommand() - Method in class frc.team670.robot.commands.arm.armTransitions.GrabBallIntakeToBackCargo
 
getCommand() - Method in class frc.team670.robot.commands.arm.armTransitions.GrabBallIntakeToNeutral
 
getCommand() - Method in class frc.team670.robot.commands.arm.armTransitions.NeutralToGrabBallIntake
 
getCommand() - Method in class frc.team670.robot.commands.arm.armTransitions.NeutralToStow
 
getCoordPosition() - Method in class frc.team670.robot.subsystems.Arm.ArmState
 
getCoordPosition(double, double, double) - Static method in class frc.team670.robot.subsystems.Arm
Returns the arm's point in forward facing plane relative to (0,0) at the base of the arm.
getCost() - Method in class frc.team670.robot.commands.arm.armTransitions.ArmTransition
Returns the sum of the number of inches that the arm must move to travel the path.
getCost() - Method in interface frc.team670.robot.utils.sort.Edge
 
getCount() - Method in class frc.team670.robot.dataCollection.sensors.SharpIRSensor
 
getCurrentLowestPointOnArm(double, double, double) - Static method in class frc.team670.robot.subsystems.Arm
Returns the arm's point in forward facing plane relative to (0,0) at the base of the arm.
getCurrentState() - Static method in class frc.team670.robot.subsystems.Arm
Gets the State that the arm most recently was located at.
getCurvature() - Method in class frc.team670.robot.utils.math.Vector
 
getDegrees() - Method in class frc.team670.robot.utils.math.Rotation2d
 
getDest() - Method in class frc.team670.robot.commands.arm.armTransitions.ArmTransition
Example for a specified transition where you would need to take certain steps to optimize it.
getDest() - Method in interface frc.team670.robot.utils.sort.Edge
 
getDistance() - Method in class frc.team670.robot.dataCollection.sensors.DIOUltrasonic
Gets the ultrasonic distance in inches adjusted for the angle to target and offset of the ultrasonic from the center of the robot.
getDistance() - Method in class frc.team670.robot.utils.math.Vector
 
getDistanceFromTarget() - Method in class frc.team670.robot.subsystems.Arm.PlaceGrabState
 
getDistanceToWallTarget() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor
 
getDPadState() - Method in class frc.team670.robot.utils.MustangController
gets angle of the DPad on the XBox controller pressed with increments of 45 degree angle.
getDriveBaseInputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getDriveBaseOutputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getDriverController() - Method in class frc.team670.robot.OI
 
getEdges() - Method in class frc.team670.robot.subsystems.Arm.ArmState
 
getEdges() - Method in interface frc.team670.robot.utils.sort.Node
 
getElbow() - Method in class frc.team670.robot.subsystems.Arm
 
getElbowAngle() - Method in class frc.team670.robot.subsystems.Arm.ArmState
Gets the absolute Elbow angle in degrees.
getEndPoint() - Method in class frc.team670.robot.commands.drive.purePursuit.Path
 
getEntry(int) - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValue_PIDSource
Gets the entry at the given index in the array at the NetworkTable entry that corresponds to this object's key.
getExtension() - Method in class frc.team670.robot.subsystems.Arm
 
getExtensionLength() - Method in class frc.team670.robot.subsystems.Arm.ArmState
Gets the absolute Extension length in inches.
getFieldCentricNavXPIDSource() - Method in class frc.team670.robot.dataCollection.sensors.NavX
Gets the NavX object itself so be careful with it and don't reset it.
getFieldCentricYaw() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getForwardLimitSwitchTripped() - Method in class frc.team670.robot.subsystems.extension.BaseExtension
 
getForwardLimitSwitchTripped() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getForwardSoftLimitAngle() - Method in class frc.team670.robot.subsystems.elbow.BaseElbow
 
getForwardSoftLimitAngle() - Method in class frc.team670.robot.subsystems.elbow.Elbow
 
getForwardSoftLimitAngle() - Method in class frc.team670.robot.subsystems.wrist.BaseWrist
 
getForwardSoftLimitAngle() - Method in class frc.team670.robot.subsystems.wrist.Wrist
 
getForwardSoftLimitInInches() - Method in class frc.team670.robot.subsystems.extension.BaseExtension
 
getForwardSoftLimitInInches() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getFrontControllerOnTarget() - Method in class frc.team670.robot.subsystems.Climber
Returns true if the front controller is on target and false if not
getFrontPistonsRetracted() - Method in class frc.team670.robot.subsystems.Climber
Returns whether or not the command for retracting the front pistons has been called and finished
getFrontPistonsRetractionInProgress() - Method in class frc.team670.robot.subsystems.Climber
Returns whether or not the command for retracting the front pistons has been called and is in progress
getFrontTalonPositionInInches() - Method in class frc.team670.robot.subsystems.Climber
Returns the position of the front pistons in inches
getFrontTalonPositionInTicks() - Method in class frc.team670.robot.subsystems.Climber
Returns the position of the front pistons in ticks
getFrontUltrasonicDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getFrontUltrasonicUnadjustedDistance() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getHAngle() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValues
Horizontal Angle to the located target in degrees.
getHAngle_PIDSource() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValues
 
getHAnglePIDSource() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor
Horizontal Angle to the vision target in degrees, as a PIDSource.
getHeldItem() - Method in class frc.team670.robot.subsystems.Arm
 
getHeuristicDistance(Node) - Method in class frc.team670.robot.subsystems.Arm.ArmState
 
getHeuristicDistance(Node) - Method in interface frc.team670.robot.utils.sort.Node
 
getId() - Method in enum frc.team670.robot.subsystems.Arm.LegalState
Gets the ID of the state.
getIntakeBeamBreakOutput() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getIntakeCoordinates() - Method in class frc.team670.robot.subsystems.BaseIntake
Returns the x, y coordinates of the top of the intake
getIntakeCoordinates() - Method in class frc.team670.robot.subsystems.Intake
Returns the x, y coordinates of the top of the intake
getIntakeIROutput() - Method in class frc.team670.robot.dataCollection.MustangSensors
Returns true if object is within threshold and false if not
getIsFront() - Method in class frc.team670.robot.subsystems.Arm.PlaceGrabState
 
getIsLowTarget() - Method in class frc.team670.robot.subsystems.Arm.PlaceGrabState
 
getLeft() - Method in class frc.team670.robot.utils.math.DrivePower
 
getLeftBumper() - Method in class frc.team670.robot.utils.MustangController
 
getLeftControllers() - Method in class frc.team670.robot.subsystems.DriveBase
 
getLeftDIODistanceInches() - Method in class frc.team670.robot.subsystems.DriveBase
 
getLeftDIOEncoder() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the left DIO Encoder
getLeftDIOEncoderPosition() - Method in class frc.team670.robot.subsystems.DriveBase
Gets the encoder position of the front left motor in ticks.
getLeftEncoderTick() - Method in class frc.team670.robot.dataCollection.Pose
The left tick value in Mustang Encoder ticks
getLeftInputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getLeftJoystickButton() - Method in class frc.team670.robot.utils.MustangController
 
getLeftMustangDriveBaseEncoder() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the MustangDriveBaseEncoder used for the left motors
getLeftMustangEncoderPositionInInches() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the position of the MustangDriveBaseEncoder used for the left motors in inches
getLeftMustangEncoderPositionInTicks() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the position of the MustangDriveBaseEncoder used for the left motors in ticks
getLeftMustangEncoderVelocityInInchesPerSecond() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the velocity of the MustangDriveBaseEncoder used for the left motors in inches/second
getLeftMustangEncoderVelocityInTicksPerSecond() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the velocity of the MustangDriveBaseEncoder used for the left motors in ticks/second
getLeftOutputCurrent() - Method in class frc.team670.robot.subsystems.DriveBase
 
getLeftOutputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getLeftSparkEncoderPosition() - Method in class frc.team670.robot.subsystems.DriveBase
Gets the encoder position of the front left motor in ticks.
getLeftSparkEncoderVelocityTicks() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the velocity of the right side of the drivebase in ticks/second from the Spark Encoder
getLeftStickX() - Method in class frc.team670.robot.utils.MustangController
helps you get various axes and buttons on the XBox controller
getLeftStickY() - Method in class frc.team670.robot.utils.MustangController
 
getLeftTriggerAxis() - Method in class frc.team670.robot.utils.MustangController
 
getLeftVelocity() - Method in class frc.team670.robot.dataCollection.Pose
Gets the left side of the robot's velocity at the time of the pose in ticks/second using Mustang Encoder ticks
getLengthInches() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getLengthInches() - Method in interface frc.team670.robot.subsystems.extension.ExtensionInterface
Gets the current Extension length in absolute ticks with 0 at no extension.
getLengthTicks() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getLengthTicks() - Method in interface frc.team670.robot.subsystems.extension.ExtensionInterface
 
getMaximumLowestPointOnClaw() - Method in class frc.team670.robot.subsystems.Arm.ArmState
Returns the lowest point on the claw/arm which should be the place the intake is most likely to hit
getMotionMagicDestinationCoordinates() - Method in class frc.team670.robot.subsystems.BaseIntake
Should return the setpoint coordinates for the motion magic on the base motor
getMotionMagicDestinationCoordinates() - Method in class frc.team670.robot.subsystems.Intake
Should return the setpoint for the motion magic on the base motor
getMotionMagicSetpoint() - Method in class frc.team670.robot.subsystems.extension.BaseExtension
 
getMotionMagicSetpoint() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getMotionMagicSetpoint() - Method in class frc.team670.robot.subsystems.RotatingSubsystem
 
getNavXPitchPIDSource() - Method in class frc.team670.robot.dataCollection.MustangSensors
Returns a PIDSource with the NavX pitch.
getNavXPitchPIDSource() - Method in class frc.team670.robot.dataCollection.sensors.NavX
Gets the NavX's pitch as a PIDSource
getOutputCurrent() - Method in class frc.team670.robot.subsystems.elbow.Elbow
 
getOutputCurrent() - Method in interface frc.team670.robot.subsystems.elbow.ElbowInterface
Returns the output current
getPath(Arm.ArmState, Arm) - Static method in class frc.team670.robot.commands.arm.movement.ArmPathGenerator
Generates using the current ArmState as its current location
getPath(Arm.ArmState, Arm.ArmState, Arm) - Static method in class frc.team670.robot.commands.arm.movement.ArmPathGenerator
Looks for an existing path.
getPath() - Method in class frc.team670.robot.commands.drive.purePursuit.PurePursuitTracker
 
getPIDSourceType() - Method in class frc.team670.robot.commands.climb.pistonClimb.NoNavXPistonClimb.ClimberEncoderPitchPIDSource
 
getPIDSourceType() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValue_PIDSource
 
getPIDSourceType() - Method in class frc.team670.robot.dataCollection.SensorCollection_PIDSource
 
getPIDSourceType() - Method in class frc.team670.robot.dataCollection.sensors.MustangDriveBaseEncoder
 
getPIDSourceType() - Method in class frc.team670.robot.dataCollection.sensors.NavX.NavX_Pitch_PIDSource
 
getPIDSourceType() - Method in class frc.team670.robot.dataCollection.sensors.NavX.ZeroableNavX_Yaw_PIDSource
 
getPitch() - Method in class frc.team670.robot.dataCollection.sensors.NavX
Gets the pitch of the NavX
getPitchDouble() - Method in class frc.team670.robot.dataCollection.MustangSensors
 
getPitchFromEncoders() - Method in class frc.team670.robot.subsystems.Climber
Returns pitch calculated from the difference in the front and back piston encoders.
getPose() - Method in class frc.team670.robot.commands.drive.purePursuit.PoseEstimator
 
getPositionInches() - Method in class frc.team670.robot.dataCollection.sensors.MustangDriveBaseEncoder
Returns the position determined by the encoder in inches
getPositionTicks() - Method in class frc.team670.robot.dataCollection.sensors.MustangDriveBaseEncoder
Returns the position determined by the encoder in ticks
getPosX() - Method in class frc.team670.robot.dataCollection.Pose
The X Position in Mustang encoder ticks
getPosY() - Method in class frc.team670.robot.dataCollection.Pose
The Y Position in Mustang Encoder ticks
getPOVValue() - Method in class frc.team670.robot.utils.MustangController
 
getRadians() - Method in class frc.team670.robot.utils.math.Rotation2d
 
getRawAccelX() - Method in class frc.team670.robot.dataCollection.sensors.NavX
 
getReverseLimitSwitchTripped() - Method in class frc.team670.robot.subsystems.extension.BaseExtension
 
getReverseLimitSwitchTripped() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getReverseSoftLimitAngle() - Method in class frc.team670.robot.subsystems.elbow.BaseElbow
 
getReverseSoftLimitAngle() - Method in class frc.team670.robot.subsystems.elbow.Elbow
 
getReverseSoftLimitAngle() - Method in class frc.team670.robot.subsystems.wrist.BaseWrist
 
getReverseSoftLimitAngle() - Method in class frc.team670.robot.subsystems.wrist.Wrist
 
getReverseSoftLimitInInches() - Method in class frc.team670.robot.subsystems.extension.BaseExtension
 
getReverseSoftLimitInInches() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getRight() - Method in class frc.team670.robot.utils.math.DrivePower
 
getRightBumper() - Method in class frc.team670.robot.utils.MustangController
 
getRightControllers() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRightDIODistanceInches() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRightDIOEncoder() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the right DIO Encoder
getRightDIOEncoderPosition() - Method in class frc.team670.robot.subsystems.DriveBase
Gets the tick count of the right encoder
getRightEncoderTick() - Method in class frc.team670.robot.dataCollection.Pose
The right tick value in Mustang Encoder ticks
getRightInputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRightJoystickButton() - Method in class frc.team670.robot.utils.MustangController
 
getRightMustangDriveBaseEncoder() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the MustangDriveBaseEncoder used for the right motors
getRightMustangEncoderPositionInInches() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the position of the MustangDriveBaseEncoder used for the right motors in inches
getRightMustangEncoderPositionInTicks() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the position of the MustangDriveBaseEncoder used for the right motors in ticks
getRightMustangEncoderVelocityInInchesPerSecond() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the velocity of the MustangDriveBaseEncoder used for the right motors in inches/second
getRightMustangEncoderVelocityInTicksPerSecond() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the velocity of the MustangDriveBaseEncoder used for the right motors in ticks/second
getRightOutputCurrent() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRightOutputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRightSparkEncoderPosition() - Method in class frc.team670.robot.subsystems.DriveBase
Gets the encoder position of the front right motor in ticks.
getRightSparkEncoderVelocityTicks() - Method in class frc.team670.robot.subsystems.DriveBase
Returns the velocity of the right side of the drivebase in ticks/second from the Spark Encoder
getRightStickX() - Method in class frc.team670.robot.utils.MustangController
 
getRightStickY() - Method in class frc.team670.robot.utils.MustangController
 
getRightTriggerAxis() - Method in class frc.team670.robot.utils.MustangController
 
getRightVelocity() - Method in class frc.team670.robot.dataCollection.Pose
Gets the right side of the robot's velocity at the time of the pose in ticks/second using Mustang Encoder ticks
getRobotAngle() - Method in class frc.team670.robot.dataCollection.Pose
 
getRobotInputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRobotOutputCurrent() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRobotOutputVoltage() - Method in class frc.team670.robot.subsystems.DriveBase
 
getRobotPath() - Method in class frc.team670.robot.commands.drive.purePursuit.Path
 
getRotation() - Method in class frc.team670.robot.utils.math.RigidTransform
 
getRotationAngle() - Method in class frc.team670.robot.dataCollection.MustangSensors
Gets the Rotation for the Pure Pursuit drive.
getSelectedAutonCommand() - Method in class frc.team670.robot.OI
 
getSource() - Method in class frc.team670.robot.commands.arm.armTransitions.ArmTransition
The LegalState that this Command will end at.
getSource() - Method in interface frc.team670.robot.utils.sort.Edge
 
getStartButton() - Method in class frc.team670.robot.utils.MustangController
 
getStartPoint() - Method in class frc.team670.robot.commands.drive.purePursuit.Path
 
getStates() - Static method in class frc.team670.robot.subsystems.Arm
 
getStatesArrayList() - Static method in class frc.team670.robot.subsystems.Arm
 
getTargetState() - Static method in class frc.team670.robot.subsystems.Arm
 
getTimeOfPose() - Method in class frc.team670.robot.dataCollection.Pose
 
getTimeout() - Method in class frc.team670.robot.subsystems.extension.Extension
 
getTimeout() - Method in class frc.team670.robot.subsystems.RotatingSubsystem
Gets the boolean to decide whether or not to pulse or stall the motor
getTimeout() - Method in interface frc.team670.robot.subsystems.TunableSubsystem
 
getTimestamp() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor
 
getTimeStamp() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValues
Gets the time stamp of the last vision calculation off the pi.
getTotalPathDistance() - Method in class frc.team670.robot.commands.drive.purePursuit.Path
 
getTrajectory() - Method in class frc.team670.robot.utils.TrajectoryBuilder
Gets the Trajectory built
getTranslation() - Method in class frc.team670.robot.utils.math.RigidTransform
 
getUnadjustedDistance() - Method in class frc.team670.robot.dataCollection.sensors.DIOUltrasonic
Gets the ultrasonic distance unadjusted for offset and angle to target
getUserWishesToStillClimb() - Static method in class frc.team670.robot.commands.climb.armClimb.ArmClimb
Returns a boolean that keeps track of whether or not the cancel command has been called
getValue() - Method in class frc.team670.robot.utils.MutableDouble
 
getVAngle() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValues
Vertical Angle to the located target in degrees.
getVAngle_PIDSource() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor.VisionValues
 
getVAnglePIDSource() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor
Vertical Angle to the vision target in degrees, as a PIDSource.
getVelocity() - Method in class frc.team670.robot.commands.drive.purePursuit.PoseEstimator
 
getVelocity() - Method in class frc.team670.robot.utils.math.Vector
 
getVelocityInches() - Method in class frc.team670.robot.dataCollection.sensors.MustangDriveBaseEncoder
Returns the velocity determined by the encoder in inches/second
getVelocityTicks() - Method in class frc.team670.robot.dataCollection.sensors.MustangDriveBaseEncoder
Returns the velocity determined by the encoder in ticks/second
getVisionValues() - Method in class frc.team670.robot.dataCollection.MustangCoprocessor
 
getVoltage() - Method in class frc.team670.robot.dataCollection.sensors.SharpIRSensor
 
getWrist() - Method in class frc.team670.robot.subsystems.Arm
 
getWristAngle() - Method in class frc.team670.robot.subsystems.Arm.ArmState
Gets the absolute Wrist angle in degrees.
getWristPulseWidth() - Method in class frc.team670.robot.subsystems.wrist.Wrist
 
getX() - Method in class frc.team670.robot.utils.math.Translation
 
getXButton() - Method in class frc.team670.robot.utils.MustangController
 
getY() - Method in class frc.team670.robot.utils.math.Translation
 
getYawDouble() - Method in class frc.team670.robot.dataCollection.MustangSensors
Returns the yaw of the robot as a double in accordance with its adjustment based on Robot starting position.
getYawDouble() - Method in class frc.team670.robot.dataCollection.sensors.NavX
Gets the yaw with offset taken into account.
getYawDoubleForPathfinder() - Method in class frc.team670.robot.dataCollection.MustangSensors
Gets the yaw for Pathfinder since it needs it mirrored from the normal way.
getYawFieldCentric() - Method in class frc.team670.robot.dataCollection.sensors.NavX
Gets the field centric yaw (0 degrees is forward for the robot from its starting position),
getYawRateDegreesPerSec() - Method in class frc.team670.robot.dataCollection.sensors.NavX
The rate of change of the NavX angle in degrees per second.
getYawRateDegreesPerSecond() - Method in class frc.team670.robot.dataCollection.MustangSensors
Returns the rate of change of the yaw angle in degrees per second.
getYawRateRadiansPerSec() - Method in class frc.team670.robot.dataCollection.sensors.NavX
The rate of change of the NavX angle in radians per second.
getYButton() - Method in class frc.team670.robot.utils.MustangController
 
getZeroableNavXPIDSource() - Method in class frc.team670.robot.dataCollection.MustangSensors
Returns a PIDSource with the NavX Yaw corresponding to the last zero (not field centric).
getZeroableNavXYawPIDSource() - Method in class frc.team670.robot.dataCollection.sensors.NavX
Gets the NavX as a PIDSource that responds to the NavX being zeroed.
GrabBallIntakeToBackCargo - Class in frc.team670.robot.commands.arm.armTransitions
A common transition that can be used to move the arm straight to any position.
GrabBallIntakeToBackCargo(Arm, BaseIntake) - Constructor for class frc.team670.robot.commands.arm.armTransitions.GrabBallIntakeToBackCargo
 
GrabBallIntakeToNeutral - Class in frc.team670.robot.commands.arm.armTransitions
A common transition that can be used to move the arm straight to any position.
GrabBallIntakeToNeutral(Arm, BaseIntake) - Constructor for class frc.team670.robot.commands.arm.armTransitions.GrabBallIntakeToNeutral
 
GrabHatch - Class in frc.team670.robot.commands.claw
Grabs the hatch by opening the intake hard.
GrabHatch(Claw, Arm) - Constructor for class frc.team670.robot.commands.claw.GrabHatch
 
A B C D E F G H I J K L M N O P Q R S T U V W X Y Z 
Skip navigation links