A
B
C
D
E
F
G
H
I
K
L
M
N
O
P
Q
R
S
T
U
V
W
X
Y
R
- raceWith(kotlin.Array) - function in com.seattlesolvers.solverslib.command.Command
- Decorates this command with a set of commands to run parallel to it, ending when the first command ends.
- raceWith(kotlin.Array) - function in com.seattlesolvers.solverslib.command.Command
- Decorates this command with a set of commands to run parallel to it, ending when the first command ends.
- RamseteCommand - class in com.seattlesolvers.solverslib.command
- A command that uses a RAMSETE controller (RamseteController) to follow a trajectory Trajectory with a differential drive.
- RamseteController - class in com.seattlesolvers.solverslib.controller.wpilibcontroller
- Ramsete is a nonlinear time-varying feedback controller for unicycle models that drives the model to a desired pose along a two-dimensional trajectory.
- RawPower - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.RunMode
- readButtons() - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
- Updates the value for each ButtonReader.
- readValue() - function in com.seattlesolvers.solverslib.gamepad.ButtonReader
- Reads button value
- readValue() - function in com.seattlesolvers.solverslib.gamepad.ButtonReader
- Reads button value
- readValue() - function in com.seattlesolvers.solverslib.gamepad.KeyReader
- Reads button value
- readValue() - function in com.seattlesolvers.solverslib.gamepad.TriggerReader
- Reads button value
- red() - function in com.seattlesolvers.solverslib.hardware.SensorColor
- Gets the red value from the sensor
- register(kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandOpMode
- Registers com.seattlesolvers.solverslib.command.Subsystem objects to the scheduler
- register(kotlin.Array) - function in com.seattlesolvers.solverslib.command.Robot
- Registers com.seattlesolvers.solverslib.command.Subsystem objects to the scheduler
- register() - function in com.seattlesolvers.solverslib.command.Subsystem
- Registers this subsystem with the CommandScheduler, allowing its periodic method to be called when the scheduler runs.
- register() - function in com.seattlesolvers.solverslib.command.Subsystem
- Registers this subsystem with the CommandScheduler, allowing its periodic method to be called when the scheduler runs.
- registerSubsystem(kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandScheduler
- Registers subsystems with the scheduler.
- relativeTo(com.seattlesolvers.solverslib.geometry.Pose2d) - function in com.seattlesolvers.solverslib.geometry.Pose2d
- Returns the other pose relative to the current pose.
- relativeTo(com.seattlesolvers.solverslib.geometry.Pose2d) - function in com.seattlesolvers.solverslib.geometry.Pose2d
- Returns the other pose relative to the current pose.
- relativeTo(com.seattlesolvers.solverslib.geometry.Pose2d,com.seattlesolvers.solverslib.geometry.Pose2d) - function in com.seattlesolvers.solverslib.geometry.Pose2dExtKt
- relativeTo(com.seattlesolvers.solverslib.geometry.Pose2d) - function in com.seattlesolvers.solverslib.trajectory.Trajectory
- Transforms all poses in the trajectory so that they are relative to the given pose.
- remainingTime() - function in com.seattlesolvers.solverslib.util.Timing.Timer
- Get the remaining time until this timer is done.
- remove(int) - function in java.util.ArrayList
- remove(Object) - function in java.util.ArrayList
- remove(Object,Object) - function in java.util.Map
- remove(Object) - function in java.util.TreeMap
- removeAll(java.util.Collection) - function in java.util.ArrayList
- removeIf(java.util.function.Predicate) - function in java.util.ArrayList
- removeTriggeredAction(com.seattlesolvers.solverslib.purepursuit.actions.TriggeredAction) - function in com.seattlesolvers.solverslib.purepursuit.Path
- Removes the first instance of the provided TriggeredAction from the path.
- removeWaypointAtIndex(int) - function in com.seattlesolvers.solverslib.command.PurePursuitCommand
- RepeatCommand - class in com.seattlesolvers.solverslib.command
- A command that runs another command repeatedly, restarting it when it ends, until this command is interrupted.
- replace(K,V) - function in java.util.TreeMap
- replace(K,V,V) - function in java.util.TreeMap
- replaceAll(java.util.function.UnaryOperator) - function in java.util.ArrayList
- replaceAll(java.util.function.BiFunction) - function in java.util.TreeMap
- requestOpModeStop() - function in com.qualcomm.robotcore.eventloop.opmode.OpModeInternal
- requireUngrouped(kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandGroupBase
- Requires that the specified commands not have been already allocated to a CommandGroup.
- requireUngrouped(kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandGroupBase
- Requires that the specified commands not have been already allocated to a CommandGroup.
- requireUngrouped(java.util.Collection) - function in com.seattlesolvers.solverslib.command.CommandGroupBase
- Requires that the specified commands not have been already allocated to a CommandGroup.
- requireUngrouped(java.util.Collection) - function in com.seattlesolvers.solverslib.command.CommandGroupBase
- Requires that the specified commands not have been already allocated to a CommandGroup.
- requiring(com.seattlesolvers.solverslib.command.Subsystem) - function in com.seattlesolvers.solverslib.command.CommandScheduler
- Returns the command currently requiring a given subsystem.
- reset() - function in com.seattlesolvers.solverslib.command.CommandOpMode
- Cancels all previous commands
- reset() - function in com.seattlesolvers.solverslib.command.CommandScheduler
- Resets the CommandScheduler instance
- reset() - function in com.seattlesolvers.solverslib.command.Robot
- Cancels all previous commands
- reset() - function in com.seattlesolvers.solverslib.command.old.Subsystem
- The reset method.
- reset() - function in com.seattlesolvers.solverslib.controller.PIDFController
- reset() - function in com.seattlesolvers.solverslib.controller.PIDFController
- reset() - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
- Reset the previous error, the integral term, and disable the controller.
- reset(com.seattlesolvers.solverslib.trajectory.TrapezoidProfile.State) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
- Reset the previous error and the integral term.
- reset(double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
- Reset the previous error and the integral term.
- reset(double,double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
- Reset the previous error and the integral term.
- reset() - function in com.seattlesolvers.solverslib.hardware.GyroEx
- reset() - function in com.seattlesolvers.solverslib.hardware.RevIMU
- reset() - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
- Resets the encoder without having to stop the motor.
- reset() - function in com.seattlesolvers.solverslib.purepursuit.Path
- Resets all the waypoints/timeouts/actions in this path.
- reset() - function in com.seattlesolvers.solverslib.purepursuit.actions.TriggeredAction
- Resets this actions.
- reset() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.EndWaypoint
- Resets this waypoint.
- reset() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
- Resets this waypoint.
- reset() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.InterruptWaypoint
- Resets this waypoint.
- reset() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
- Resets this waypoint.
- reset() - function in com.seattlesolvers.solverslib.util.Timing.Rate
- resetEncoder() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
- Resets the external encoder wrapper value.
- resetEncoder() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
- Resets the external encoder wrapper value.
- resetEncoder() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
- Resets the external encoder wrapper value.
- resetPosition(com.seattlesolvers.solverslib.geometry.Pose2d,com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.kinematics.wpilibkinematics.DifferentialDriveOdometry
- Resets the robot's position on the field.
- resetPosition(com.seattlesolvers.solverslib.geometry.Pose2d,com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.kinematics.wpilibkinematics.MecanumDriveOdometry
- Resets the robot's position on the field.
- resetPosition(com.seattlesolvers.solverslib.geometry.Pose2d,com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.kinematics.wpilibkinematics.SwerveDriveOdometry
- Resets the robot's position on the field.
- resetRuntime() - function in com.qualcomm.robotcore.eventloop.opmode.OpMode
- resetTimeouts() - function in com.seattlesolvers.solverslib.purepursuit.Path
- Resets all timeouts.
- resume() - function in com.seattlesolvers.solverslib.util.Timing.Timer
- Resumes this timer if it is running and paused.
- retainAll(java.util.Collection) - function in java.util.ArrayList
- REVERSE - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.Direction
- RevIMU - class in com.seattlesolvers.solverslib.hardware
- RGBtoHSV(int,int,int,kotlin.Array) - function in com.seattlesolvers.solverslib.hardware.SensorColor
- Converts an RGB value to an HSV value.
- RIGHT - enum entry in com.seattlesolvers.solverslib.util.Direction
- RIGHT_BUMPER - enum entry in com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button
- RIGHT_STICK_BUTTON - enum entry in com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button
- RIGHT_TRIGGER - enum entry in com.seattlesolvers.solverslib.gamepad.GamepadKeys.Trigger
- Robot - class in com.seattlesolvers.solverslib.command
- This is the Robot class.
- RobotDrive - class in com.seattlesolvers.solverslib.drivebase
- RobotDrive.MotorType - class in com.seattlesolvers.solverslib.drivebase.RobotDrive
- The location of the motor on the robot.
- RobotDriveExtKt - class in com.seattlesolvers.solverslib.drivebase
- rotate(double) - function in com.seattlesolvers.solverslib.geometry.Pose2d
- rotate(double) - function in com.seattlesolvers.solverslib.geometry.Pose2d
- rotate(com.seattlesolvers.solverslib.geometry.Pose2d,java.lang.Number) - function in com.seattlesolvers.solverslib.geometry.Pose2dExtKt
- rotateBy(com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.geometry.Rotation2d
- Adds the new rotation to the current rotation using a rotation matrix.
- rotateBy(com.seattlesolvers.solverslib.geometry.Rotation2d,com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.geometry.Rotation2dExtKt
- rotateBy(com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.geometry.Translation2d
- Applies a rotation to the translation in 2d space.
- rotateBy(com.seattlesolvers.solverslib.geometry.Translation2d,com.seattlesolvers.solverslib.geometry.Rotation2d) - function in com.seattlesolvers.solverslib.geometry.Translation2dExtKt
- rotateBy(double) - function in com.seattlesolvers.solverslib.geometry.Vector2d
- Rotate the vector in Cartesian space.
- rotateBy(com.seattlesolvers.solverslib.geometry.Vector2d,java.lang.Number) - function in com.seattlesolvers.solverslib.geometry.Vector2dExtKt
- rotateBy(double) - function in com.seattlesolvers.solverslib.hardware.ServoEx
- Rotates by a given positional factor.
- rotateBy(double) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
- Rotates by a given positional factor.
- rotateByAngle(double) - function in com.seattlesolvers.solverslib.hardware.ServoEx
- Rotates the servo by a certain angle in degrees.
- rotateByAngle(double,org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.ServoEx
- Rotates the servo by a certain angle.
- rotateByAngle(double) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
- Rotates the servo by a certain angle in degrees.
- rotateByAngle(double,org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
- Rotates the servo by a certain angle.
- rotatePose(double) - function in com.seattlesolvers.solverslib.kinematics.Odometry
- Rotates the position of the robot by a given angle
- rotatePose(double) - function in com.seattlesolvers.solverslib.kinematics.Odometry
- Rotates the position of the robot by a given angle
- Rotation2d - class in com.seattlesolvers.solverslib.geometry
- A rotation in a 2d coordinate frame represented a point on the unit circle (cosine and sine).
- Rotation2dExtKt - class in com.seattlesolvers.solverslib.geometry
- rotationEqualsWithBuffer(double,double,double) - function in com.seattlesolvers.solverslib.purepursuit.PurePursuitUtil
- Calculates whether or not two angles are equal within a margin of error.
- round(double,int) - function in com.seattlesolvers.solverslib.util.MathUtils
- Returns value rounded to specified places
- RPM_1150 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_117 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_1620 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_223 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_30 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_312 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_43 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_435 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_60 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- RPM_84 - enum entry in com.seattlesolvers.solverslib.hardware.motors.Motor.GoBILDA
- run() - function in com.seattlesolvers.solverslib.command.CommandOpMode
- Runs the CommandScheduler instance
- run() - function in com.seattlesolvers.solverslib.command.CommandScheduler
- Runs a single iteration of the scheduler.
- run() - function in com.seattlesolvers.solverslib.command.Robot
- Runs the CommandScheduler instance
- run() - function in com.seattlesolvers.solverslib.command.old.CommandOpMode
- Run Op Mode.
- RunCommand - class in com.seattlesolvers.solverslib.command
- A command that runs a Runnable continuously.
- runOpMode() - function in com.seattlesolvers.solverslib.command.CommandOpMode
- runOpMode() - function in com.seattlesolvers.solverslib.command.old.CommandOpMode
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.Command
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.Command
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.ConditionalCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.LogCatCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.ParallelCommandGroup
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.ParallelDeadlineGroup
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.ParallelRaceGroup
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.PerpetualCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.PrintCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.RepeatCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.ScheduleCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.SelectCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.SequentialCommandGroup
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.WaitCommand
- Whether the given command should run when the robot is disabled.
- runsWhenDisabled() - function in com.seattlesolvers.solverslib.command.WaitUntilCommand
- Whether the given command should run when the robot is disabled.