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

G

GamepadButton - class in com.seattlesolvers.solverslib.command.button
A Button that gets its state from a GamepadEx.
GamepadEx - class in com.seattlesolvers.solverslib.gamepad
An extended gamepad for more advanced toggles, key events, and other control processors.
GamepadExExtKt - class in com.seattlesolvers.solverslib.gamepad
 
GamepadKeys - class in com.seattlesolvers.solverslib.gamepad
An enumerator for the different keys on the gamepad, including bumpers, buttons, and triggers.
GamepadKeys.Button - class in com.seattlesolvers.solverslib.gamepad.GamepadKeys
 
GamepadKeys.Trigger - class in com.seattlesolvers.solverslib.gamepad.GamepadKeys
 
GENERAL - enum entry in com.seattlesolvers.solverslib.purepursuit.types.WaypointType
 
GeneralWaypoint - class in com.seattlesolvers.solverslib.purepursuit.waypoints
A general waypoint is the most common type of Waypoint.
generateTrajectory(com.seattlesolvers.solverslib.geometry.Pose2d,java.util.List,com.seattlesolvers.solverslib.geometry.Pose2d,com.seattlesolvers.solverslib.trajectory.TrajectoryConfig) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator
Generates a trajectory from the given waypoints and config.
generateTrajectory(com.seattlesolvers.solverslib.spline.Spline.ControlVector,java.util.List,com.seattlesolvers.solverslib.spline.Spline.ControlVector,com.seattlesolvers.solverslib.trajectory.TrajectoryConfig) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator
Generates a trajectory from the given control vectors and config.
generateTrajectory(com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator.ControlVectorList,com.seattlesolvers.solverslib.trajectory.TrajectoryConfig) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator
Generates a trajectory from the given quintic control vectors and config.
generateTrajectory(java.util.List,com.seattlesolvers.solverslib.trajectory.TrajectoryConfig) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator
Generates a trajectory from the given waypoints and config.
get() - function in com.seattlesolvers.solverslib.command.button.GamepadButton
Gets the value of the joystick button.
get() - function in com.seattlesolvers.solverslib.command.button.Trigger
Returns whether or not the trigger is active.
get() - function in com.seattlesolvers.solverslib.command.button.Trigger
Returns whether or not the trigger is active.
get() - function in com.seattlesolvers.solverslib.hardware.motors.CRServo
Common method for getting the current set speed of a motor.
get() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for getting the current set speed of a motor.
get() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for getting the current set speed of a motor.
get() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
get(double) - function in com.seattlesolvers.solverslib.util.InterpLUT
Interpolates the value of Y = f(X) for given X.
get(com.seattlesolvers.solverslib.util.InterpLUT,java.lang.Number) - function in com.seattlesolvers.solverslib.util.InterpLUTExtKt
 
get(int) - function in java.util.ArrayList
 
get(Object) - function in java.util.TreeMap
 
getAbsoluteHeading() - function in com.seattlesolvers.solverslib.hardware.GyroEx
 
getAbsoluteHeading() - function in com.seattlesolvers.solverslib.hardware.RevIMU
 
getAcceleration() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
 
getAcceleration() - function in com.seattlesolvers.solverslib.hardware.motors.MotorEx
 
getAchievableMaxTicksPerSecond() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
 
getAngle() - function in com.seattlesolvers.solverslib.geometry.Vector2dExtKt
 
getAngle() - function in com.seattlesolvers.solverslib.hardware.ServoEx
 
getAngle(org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.ServoEx
 
getAngle() - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getAngle(org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getAngleRange() - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getAngleRange(org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getAngles() - function in com.seattlesolvers.solverslib.hardware.GyroEx
 
getAngles() - function in com.seattlesolvers.solverslib.hardware.RevIMU
 
getARGB() - function in com.seattlesolvers.solverslib.hardware.SensorColor
Get all the ARGB values in an array from the sensor
getBehavior() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.ZeroPowerBehavior
 
getButton(com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button) - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getCause() - function in java.lang.Throwable
 
getClosest(T) - function in com.seattlesolvers.solverslib.util.LUT
Returns the closest possible value for the given key.
getCoefficients() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getCoefficients() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getConstraints() - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Returns the user-defined constraints of the trajectory.
getController() - function in com.seattlesolvers.solverslib.command.ProfiledPIDCommand
Returns the ProfiledPIDController used by the command.
getController() - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
getController() - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
getCorrectedVelocity() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getCorrectedVelocity() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getCorrectedVelocity() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
Corrects for velocity overflow
getCos() - function in com.seattlesolvers.solverslib.geometry.Rotation2d
Returns the cosine of the rotation.
getCPR() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getCPR() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getCPR() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
 
getCubicControlVectorsFromWaypoints(com.seattlesolvers.solverslib.geometry.Pose2d,kotlin.Array,com.seattlesolvers.solverslib.geometry.Pose2d) - function in com.seattlesolvers.solverslib.spline.SplineHelper
Returns 2 cubic control vectors from a set of exterior waypoints and interior translations.
getCubicSplinesFromControlVectors(com.seattlesolvers.solverslib.spline.Spline.ControlVector,kotlin.Array,com.seattlesolvers.solverslib.spline.Spline.ControlVector) - function in com.seattlesolvers.solverslib.spline.SplineHelper
Returns a set of cubic splines corresponding to the provided control vectors.
getCurrent(org.firstinspires.ftc.robotcore.external.navigation.CurrentUnit) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getCurrentAlert(org.firstinspires.ftc.robotcore.external.navigation.CurrentUnit) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getCurrentCommand() - function in com.seattlesolvers.solverslib.command.Subsystem
Returns the command currently running on this subsystem.
getCurrentCommand() - function in com.seattlesolvers.solverslib.command.Subsystem
Returns the command currently running on this subsystem.
getCurrentPosition() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getCurrentPosition() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getD() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getD() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getD() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Gets the differential coefficient.
getDefaultCommand(com.seattlesolvers.solverslib.command.Subsystem) - function in com.seattlesolvers.solverslib.command.CommandScheduler
Gets the default command associated with this subsystem.
getDefaultCommand() - function in com.seattlesolvers.solverslib.command.Subsystem
Gets the default command for this subsystem.
getDefaultCommand() - function in com.seattlesolvers.solverslib.command.Subsystem
Gets the default command for this subsystem.
getDegrees() - function in com.seattlesolvers.solverslib.geometry.Rotation2d
Returns the degree value of the rotation.
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.HardwareDevice
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.HardwareDevice
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.RevIMU
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.SensorColor
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.SensorDistance
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.SensorRevTOFDistance
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.ServoEx
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.motors.MotorEx
 
getDeviceType() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
getDirection() - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
getDistance(com.seattlesolvers.solverslib.geometry.Translation2d) - function in com.seattlesolvers.solverslib.geometry.Translation2d
Calculates the distance between two translations in 2d space.
getDistance(org.firstinspires.ftc.robotcore.external.navigation.DistanceUnit) - function in com.seattlesolvers.solverslib.hardware.SensorDistance
Gets the current distance from the sensor.
getDistance(org.firstinspires.ftc.robotcore.external.navigation.DistanceUnit) - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx
Gets the current distance from the sensor.
getDistance(org.firstinspires.ftc.robotcore.external.navigation.DistanceUnit) - function in com.seattlesolvers.solverslib.hardware.SensorRevTOFDistance
Gets the current distance from the sensor.
getDistance() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getDistance() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getDistance() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
 
getEndVelocity() - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Returns the starting velocity of the trajectory.
getF() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getF() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getFeedforwardCoefficients() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getFeedforwardCoefficients() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getFollowDistance() - function in com.seattlesolvers.solverslib.purepursuit.Waypoint
Returns the follow distance for this waypoint.
getFollowDistance() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the follow distance for this waypoint.
getFollowDistance() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the follow distance for this waypoint.
getFollowDistance() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.StartWaypoint
Returns the follow distance for this waypoint.
getFollowRadius() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the follow radius of this waypoint.
getFollowRadius() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the follow radius of this waypoint.
getGamepadButton(com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button) - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getGoal() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Gets the goal for the ProfiledPIDController.
getHeading() - function in com.seattlesolvers.solverslib.geometry.Pose2d
 
getHeading() - function in com.seattlesolvers.solverslib.geometry.Pose2d
 
getHeading() - function in com.seattlesolvers.solverslib.hardware.GyroEx
 
getHeading() - function in com.seattlesolvers.solverslib.hardware.RevIMU
 
getI() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getI() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getI() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Gets the integral coefficient.
getInitialPose() - function in com.seattlesolvers.solverslib.trajectory.Trajectory
Returns the initial pose of the trajectory.
getInstance() - function in com.seattlesolvers.solverslib.command.CommandScheduler
Returns the Scheduler instance.
getInverse() - function in com.seattlesolvers.solverslib.geometry.Transform2dExtKt
 
getInverted() - function in com.seattlesolvers.solverslib.hardware.ServoEx
 
getInverted() - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getInverted() - function in com.seattlesolvers.solverslib.hardware.motors.CRServo
Common method for returning if a motor is in the inverted state or not.
getInverted() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for returning if a motor is in the inverted state or not.
getInverted() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for returning if a motor is in the inverted state or not.
getInverted() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
getLeftX() - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getLeftY() - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getLocalizedMessage() - function in java.lang.Throwable
 
getMagnitude() - function in com.seattlesolvers.solverslib.geometry.Vector2dExtKt
 
getMaxAcceleration() - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Returns the maximum acceleration of the trajectory.
getMaxRPM() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getMaxRPM() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getMaxVelocity() - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Returns the maximum velocity of the trajectory.
getMaxVelocityMetersPerSecond(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.CentripetalAccelerationConstraint
Returns the max velocity given the current pose and curvature.
getMaxVelocityMetersPerSecond(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.DifferentialDriveKinematicsConstraint
Returns the max velocity given the current pose and curvature.
getMaxVelocityMetersPerSecond(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.DifferentialDriveVoltageConstraint
Returns the max velocity given the current pose and curvature.
getMaxVelocityMetersPerSecond(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.MecanumDriveKinematicsConstraint
Returns the max velocity given the current pose and curvature.
getMaxVelocityMetersPerSecond(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.SwerveDriveKinematicsConstraint
Returns the max velocity given the current pose and curvature.
getMaxVelocityMetersPerSecond(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.TrajectoryConstraint
Returns the max velocity given the current pose and curvature.
getMessage() - function in java.lang.Throwable
 
getMinMaxAccelerationMetersPerSecondSq(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.CentripetalAccelerationConstraint
Returns the minimum and maximum allowable acceleration for the trajectory given pose, curvature, and speed.
getMinMaxAccelerationMetersPerSecondSq(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.DifferentialDriveKinematicsConstraint
Returns the minimum and maximum allowable acceleration for the trajectory given pose, curvature, and speed.
getMinMaxAccelerationMetersPerSecondSq(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.DifferentialDriveVoltageConstraint
Returns the minimum and maximum allowable acceleration for the trajectory given pose, curvature, and speed.
getMinMaxAccelerationMetersPerSecondSq(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.MecanumDriveKinematicsConstraint
Returns the minimum and maximum allowable acceleration for the trajectory given pose, curvature, and speed.
getMinMaxAccelerationMetersPerSecondSq(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.SwerveDriveKinematicsConstraint
Returns the minimum and maximum allowable acceleration for the trajectory given pose, curvature, and speed.
getMinMaxAccelerationMetersPerSecondSq(com.seattlesolvers.solverslib.geometry.Pose2d,double,double) - function in com.seattlesolvers.solverslib.trajectory.constraint.TrajectoryConstraint
Returns the minimum and maximum allowable acceleration for the trajectory given pose, curvature, and speed.
getMode() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
getMode() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getMovementSpeed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the movement speed of this waypoint.
getMovementSpeed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the movement speed of this waypoint.
getMultiplier() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Direction
 
getName() - function in com.seattlesolvers.solverslib.command.Command
 
getName() - function in com.seattlesolvers.solverslib.command.CommandBase
 
getName() - function in com.seattlesolvers.solverslib.command.CommandBase
 
getName() - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
getName() - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
getName() - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
 
getNorm() - function in com.seattlesolvers.solverslib.geometry.Translation2d
Returns the norm, or distance from the origin to the translation.
getOrDefault(Object,V) - function in java.util.Map
 
getP() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getP() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getP() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Gets the proportional coefficient.
getPeriod() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getPeriod() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getPeriod() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Gets the period of this controller.
getPoint(double) - function in com.seattlesolvers.solverslib.spline.Spline
Gets the pose and curvature at some point t on the spline.
getPoint(double) - function in com.seattlesolvers.solverslib.spline.Spline
Gets the pose and curvature at some point t on the spline.
getPortNumber() - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
getPortNumber() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
getPortNumber() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getPortNumber() - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
getPose() - function in com.seattlesolvers.solverslib.command.OdometrySubsystem
 
getPose() - function in com.seattlesolvers.solverslib.kinematics.Odometry
Returns the Pose2d object that represents the current robot position
getPose() - function in com.seattlesolvers.solverslib.kinematics.Odometry
Returns the Pose2d object that represents the current robot position
getPose() - function in com.seattlesolvers.solverslib.purepursuit.Waypoint
Returns this Waypoint's position.
getPose() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns this Waypoint's position.
getPose() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns this Waypoint's position.
getPose() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.StartWaypoint
Returns this Waypoint's position.
getPoseMeters() - function in com.seattlesolvers.solverslib.kinematics.wpilibkinematics.DifferentialDriveOdometry
Returns the position of the robot on the field.
getPoseMeters() - function in com.seattlesolvers.solverslib.kinematics.wpilibkinematics.MecanumDriveOdometry
Returns the position of the robot on the field.
getPoseMeters() - function in com.seattlesolvers.solverslib.kinematics.wpilibkinematics.SwerveDriveOdometry
Returns the position of the robot on the field.
getPosition() - function in com.seattlesolvers.solverslib.hardware.ServoEx
 
getPosition() - function in com.seattlesolvers.solverslib.hardware.SimpleServo
 
getPosition() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
 
getPosition() - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
Returns the normalized position of the axon servo.
getPosition() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
getPosition() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getPosition() - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
getPosition(int) - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
getPositionBuffer() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Returns this waypoint's position buffer.
getPositionBuffer() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Returns this waypoint's position buffer.
getPositionCoefficient() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getPositionCoefficient() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getPositionError() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getPositionError() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getPositionError() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Returns the difference between the setpoint and the measurement.
getPositions() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
getPower() - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
getPower() - function in com.seattlesolvers.solverslib.solversHardware.SolversCRServo
 
getPower() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
getPower() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getPowerFloat() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
getPowerFloat() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
getPreferredAngle() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns this waypoint's preferred angle (in radians).
getPreferredAngle() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns this waypoint's preferred angle (in radians).
getQuinticControlVectorsFromWaypoints(java.util.List) - function in com.seattlesolvers.solverslib.spline.SplineHelper
Returns quintic control vectors from a set of waypoints.
getQuinticSplinesFromControlVectors(kotlin.Array) - function in com.seattlesolvers.solverslib.spline.SplineHelper
Returns a set of quintic splines corresponding to the provided control vectors.
getRadians() - function in com.seattlesolvers.solverslib.geometry.Rotation2d
 
getRange() - function in com.seattlesolvers.solverslib.hardware.SimpleServoExtKt
 
getRate() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getRate() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getRate() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
 
getRawPosition() - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
Returns the CURRENT position of the axon servo.
getRawVelocity() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
 
getRequirements() - function in com.seattlesolvers.solverslib.command.Command
Specifies the set of subsystems used by this command.
getRequirements() - function in com.seattlesolvers.solverslib.command.CommandBase
Specifies the set of subsystems used by this command.
getRequirements() - function in com.seattlesolvers.solverslib.command.CommandBase
Specifies the set of subsystems used by this command.
getRevIMU() - function in com.seattlesolvers.solverslib.hardware.RevIMU
 
getRevolutions() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
 
getRightX() - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getRightY() - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getRotation() - function in com.seattlesolvers.solverslib.geometry.Pose2d
Returns the rotational component of the transformation.
getRotation() - function in com.seattlesolvers.solverslib.geometry.Pose2d
Returns the rotational component of the transformation.
getRotation() - function in com.seattlesolvers.solverslib.geometry.Transform2d
Returns the rotational component of the transformation.
getRotation2d() - function in com.seattlesolvers.solverslib.hardware.GyroEx
 
getRotation2d() - function in com.seattlesolvers.solverslib.hardware.RevIMU
 
getRotationBuffer() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Returns this waypoint's rotation buffer.
getRotationBuffer() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Returns this waypoint's rotation buffer.
getRPM() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
 
getRuntime() - function in com.qualcomm.robotcore.eventloop.opmode.OpMode
 
getSetPoint() - function in com.seattlesolvers.solverslib.controller.PIDFController
Returns the current setpoint of the PIDFController.
getSetPoint() - function in com.seattlesolvers.solverslib.controller.PIDFController
Returns the current setpoint of the PIDFController.
getSetpoint() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Returns the current setpoint of the ProfiledPIDController.
getSin() - function in com.seattlesolvers.solverslib.geometry.Rotation2d
Returns the sine of the rotation.
getSpeeds() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
getStackTrace() - function in java.lang.Throwable
 
getStartVelocity() - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Returns the starting velocity of the trajectory.
getState() - function in com.seattlesolvers.solverslib.gamepad.ToggleButtonReader
 
getStates() - function in com.seattlesolvers.solverslib.trajectory.Trajectory
Return the states of the trajectory.
getSubsystem() - function in com.seattlesolvers.solverslib.command.CommandBase
 
getSubsystem() - function in com.seattlesolvers.solverslib.command.CommandBase
 
getSubsystem() - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
getSubsystem() - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
getSuppressed() - function in java.lang.Throwable
 
getTan() - function in com.seattlesolvers.solverslib.geometry.Rotation2d
Returns the tangent of the rotation.
getTarget() - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
 
getThreshold() - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
Gets the acceptable error range
getTimeout() - function in com.seattlesolvers.solverslib.purepursuit.Waypoint
Returns the timeout period of this waypoint.
getTimeout() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the timeout period of this waypoint.
getTimeout() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the timeout period of this waypoint.
getTimeout() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.StartWaypoint
Returns the timeout period of this waypoint.
getTolerance() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getTolerance() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getTotalTimeSeconds() - function in com.seattlesolvers.solverslib.trajectory.Trajectory
Returns the overall duration of the trajectory.
getTranslation() - function in com.seattlesolvers.solverslib.geometry.Pose2d
Returns the translation component of the transformation.
getTranslation() - function in com.seattlesolvers.solverslib.geometry.Pose2d
Returns the translation component of the transformation.
getTranslation() - function in com.seattlesolvers.solverslib.geometry.Transform2d
Returns the translation component of the transformation.
getTrigger(com.seattlesolvers.solverslib.gamepad.GamepadKeys.Trigger) - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
 
getTurnSpeed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the turn speed of this waypoint.
getTurnSpeed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns the turn speed of this waypoint.
getType() - function in com.seattlesolvers.solverslib.purepursuit.Waypoint
Returns this WayPoint's type.
getType() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.EndWaypoint
Returns this WayPoint's type.
getType() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Returns this WayPoint's type.
getType() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.InterruptWaypoint
Returns this WayPoint's type.
getType() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Returns this WayPoint's type.
getType() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.StartWaypoint
Returns this WayPoint's type.
getUnit() - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
Gets the unit of distance
getVelocities() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
getVelocity() - function in com.seattlesolvers.solverslib.hardware.motors.MotorEx
 
getVelocity() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
 
getVelocityError() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getVelocityError() - function in com.seattlesolvers.solverslib.controller.PIDFController
 
getVelocityError() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Returns the change in error per second.
getVeloCoefficients() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getVeloCoefficients() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
 
getX() - function in com.seattlesolvers.solverslib.geometry.Pose2d
 
getX() - function in com.seattlesolvers.solverslib.geometry.Pose2d
 
getX() - function in com.seattlesolvers.solverslib.geometry.Translation2d
Returns the X component of the translation.
getX() - function in com.seattlesolvers.solverslib.geometry.Vector2d
the x component of the vector
getY() - function in com.seattlesolvers.solverslib.geometry.Pose2d
 
getY() - function in com.seattlesolvers.solverslib.geometry.Pose2d
 
getY() - function in com.seattlesolvers.solverslib.geometry.Translation2d
Returns the Y component of the translation.
getY() - function in com.seattlesolvers.solverslib.geometry.Vector2d
the y component of the vector
getZeroPowerBehavior() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
getZeroPowerBehavior() - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
green() - function in com.seattlesolvers.solverslib.hardware.SensorColor
Gets the green value from the sensor
GyroEx - class in com.seattlesolvers.solverslib.hardware
 
A  B  C  D  E  F  G  H  I  K  L  M  N  O  P  Q  R  S  T  U  V  W  X  Y