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

S

sample(double) - function in com.seattlesolvers.solverslib.trajectory.Trajectory
Sample the trajectory at a point in time.
scalarProject(com.seattlesolvers.solverslib.geometry.Vector2d) - function in com.seattlesolvers.solverslib.geometry.Vector2d
Returns scalar projection of this vector onto another vector.
scalarProject(com.seattlesolvers.solverslib.geometry.Vector2d,com.seattlesolvers.solverslib.geometry.Vector2d) - function in com.seattlesolvers.solverslib.geometry.Vector2dExtKt
 
scale(double) - function in com.seattlesolvers.solverslib.geometry.Vector2d
Scales the values of the vector by some scalar
scale(com.seattlesolvers.solverslib.geometry.Vector2d,java.lang.Number) - function in com.seattlesolvers.solverslib.geometry.Vector2dExtKt
 
scaleRange(double,double) - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
schedule() - function in com.seattlesolvers.solverslib.command.Command
Schedules this command, defaulting to interruptible.
schedule() - function in com.seattlesolvers.solverslib.command.Command
Schedules this command, defaulting to interruptible.
schedule(boolean) - function in com.seattlesolvers.solverslib.command.Command
Schedules this command.
schedule(boolean) - function in com.seattlesolvers.solverslib.command.Command
Schedules this command.
schedule(kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandOpMode
Schedules com.seattlesolvers.solverslib.command.Command objects to the scheduler
schedule(boolean,kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandScheduler
Schedules multiple commands for execution.
schedule(kotlin.Array) - function in com.seattlesolvers.solverslib.command.CommandScheduler
Schedules multiple commands for execution, with interruptible defaulted to true.
schedule(kotlin.Array) - function in com.seattlesolvers.solverslib.command.Robot
Schedules com.seattlesolvers.solverslib.command.Command objects to the scheduler
ScheduleCommand - class in com.seattlesolvers.solverslib.command
Schedules the given commands when this command is initialized.
SelectCommand - class in com.seattlesolvers.solverslib.command
Runs one of a selection of commands, either using a selector and a key to command mapping, or a supplier that returns the command directly at runtime.
SensorColor - class in com.seattlesolvers.solverslib.hardware
 
SensorDistance - class in com.seattlesolvers.solverslib.hardware
 
SensorDistanceEx - class in com.seattlesolvers.solverslib.hardware
 
SensorDistanceEx.DistanceTarget - class in com.seattlesolvers.solverslib.hardware.SensorDistanceEx
Represents a target distance
SensorRevTOFDistance - class in com.seattlesolvers.solverslib.hardware
Class for a time-of-flight distance sensor
SequentialCommandGroup - class in com.seattlesolvers.solverslib.command
A CommandGroups that runs a list of commands in sequence.
SequentialCommandGroup - class in com.seattlesolvers.solverslib.command.old
Allows you to combine multiple commands into one.
ServoEx - class in com.seattlesolvers.solverslib.hardware
An extended servo interface.
set(double) - function in com.seattlesolvers.solverslib.hardware.motors.CRServo
Common method for setting the speed of a motor.
set(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for setting the speed of a motor.
set(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorEx
Common method for setting the speed of a motor.
set(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Set the speed for each motor in the group
set(com.seattlesolvers.solverslib.util.InterpLUT,java.lang.Number,java.lang.Number) - function in com.seattlesolvers.solverslib.util.InterpLUTExtKt
 
set(int,E) - function in java.util.ArrayList
 
setAction(com.seattlesolvers.solverslib.purepursuit.actions.InterruptAction) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.EndWaypoint
Sets the action of this InterruptWaypoint.
setAction(com.seattlesolvers.solverslib.purepursuit.actions.InterruptAction) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.InterruptWaypoint
Sets the action of this InterruptWaypoint.
setBuffer(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the buffer for the motor.
setBuffer(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the buffer for the motor.
setCachingThreshold(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
setCachingThreshold(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversCRServo
 
setCachingThreshold(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
setCachingThreshold(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
setConstraints(com.seattlesolvers.solverslib.trajectory.TrapezoidProfile.Constraints) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Set velocity and acceleration constraints for goal.
setCurrentAlert(double,org.firstinspires.ftc.robotcore.external.navigation.CurrentUnit) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
setD(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setD(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setD(double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the differential coefficient of the PID controller gain.
setDeadline(com.seattlesolvers.solverslib.command.Command) - function in com.seattlesolvers.solverslib.command.ParallelDeadlineGroup
Sets the deadline to the given command.
setDefaultCommand(com.seattlesolvers.solverslib.command.Subsystem,com.seattlesolvers.solverslib.command.Command) - function in com.seattlesolvers.solverslib.command.CommandScheduler
Sets the default command for a subsystem.
setDefaultCommand(com.seattlesolvers.solverslib.command.Command) - function in com.seattlesolvers.solverslib.command.Subsystem
Sets the default Command of the subsystem.
setDefaultCommand(com.seattlesolvers.solverslib.command.Command) - function in com.seattlesolvers.solverslib.command.Subsystem
Sets the default Command of the subsystem.
setDefaultMotionProfile(com.seattlesolvers.solverslib.purepursuit.PathMotionProfile) - function in com.seattlesolvers.solverslib.purepursuit.Path
Sets the default motion profile.
setDirection(com.seattlesolvers.solverslib.hardware.motors.Motor.Direction) - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
Sets the direction of the encoder to forward or reverse
setDirection(com.qualcomm.robotcore.hardware.DcMotorSimple.Direction) - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
setDirection(com.qualcomm.robotcore.hardware.DcMotorSimple.Direction) - function in com.seattlesolvers.solverslib.solversHardware.SolversCRServo
 
setDirection(com.qualcomm.robotcore.hardware.DcMotorSimple.Direction) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
setDirection(com.qualcomm.robotcore.hardware.DcMotorSimple.Direction) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
setDirection(com.qualcomm.robotcore.hardware.Servo.Direction) - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
setDistancePerPulse(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the distance per pulse of the encoder in units per tick.
setDistancePerPulse(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the distance per pulse of the encoder in units per tick.
setDistancePerPulse(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor.Encoder
Sets the distance per pulse of the encoder.
setDistancePerPulse(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Sets the distance per pulse of the encoder in units per tick.
setEndVelocity(double) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Sets the end velocity of the trajectory.
setErrorHandler(java.util.function.BiConsumer) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator
Set error reporting function.
setF(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setF(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setFeedforwardCoefficients(double,double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the feedforward coefficients for the motor.
setFeedforwardCoefficients(double,double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the feedforward coefficients for the motor.
setFeedforwardCoefficients(double,double,double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the feedforward coefficients for the motor.
setFeedforwardCoefficients(double,double,double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the feedforward coefficients for the motor.
setFeedforwardCoefficients(double,double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Set the feedforward coefficients for the motor.
setFeedforwardCoefficients(double,double,double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Set the feedforward coefficients for the motor.
setFollowRadius(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the follow radius of this waypoint.
setFollowRadius(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the follow radius of this waypoint.
setGoal(com.seattlesolvers.solverslib.trajectory.TrapezoidProfile.State) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the goal for the ProfiledPIDController.
setGoal(double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the goal for the ProfiledPIDController.
setI(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setI(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setI(double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the integral coefficient of the PID controller gain.
setIntegrationBounds(double,double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setIntegrationBounds(double,double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setInverted(boolean) - function in com.seattlesolvers.solverslib.hardware.ServoEx
Sets the inversion factor of the servo.
setInverted(boolean) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
Sets the inversion factor of the servo.
setInverted(boolean) - function in com.seattlesolvers.solverslib.hardware.motors.CRServo
Common method for inverting direction of a motor.
setInverted(boolean) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for inverting direction of a motor.
setInverted(boolean) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Common method for inverting direction of a motor.
setInverted(boolean) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Set the motor group to the inverted direction or forward direction.
setKinematics(com.seattlesolvers.solverslib.kinematics.wpilibkinematics.DifferentialDriveKinematics) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Adds a differential drive kinematics constraint to ensure that no wheel velocity of a differential drive goes above the max velocity.
setKinematics(com.seattlesolvers.solverslib.kinematics.wpilibkinematics.MecanumDriveKinematics) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Adds a mecanum drive kinematics constraint to ensure that no wheel velocity of a mecanum drive goes above the max velocity.
setKinematics(com.seattlesolvers.solverslib.kinematics.wpilibkinematics.SwerveDriveKinematics) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Adds a swerve drive kinematics constraint to ensure that no wheel velocity of a swerve drive goes above the max velocity.
setMaxSpeed(double) - function in com.seattlesolvers.solverslib.drivebase.DifferentialDrive
Sets the max speed of the drivebase, see RobotDrive for more info.
setMaxSpeed(double) - function in com.seattlesolvers.solverslib.drivebase.HDrive
Sets the max speed of the drivebase, see RobotDrive for more info.
setMaxSpeed(double) - function in com.seattlesolvers.solverslib.drivebase.MecanumDrive
Sets the max speed of the drivebase, see RobotDrive for more info.
setMaxSpeed(double) - function in com.seattlesolvers.solverslib.drivebase.RobotDrive
Scale the output speed to the specified maxOutput value.
setMaxSpeed(T,java.lang.Number) - function in com.seattlesolvers.solverslib.drivebase.RobotDriveExtKt
 
setMode(com.qualcomm.robotcore.hardware.DcMotor.RunMode) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
setMode(com.qualcomm.robotcore.hardware.DcMotor.RunMode) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
setMotionProfile(com.seattlesolvers.solverslib.purepursuit.PathMotionProfile) - function in com.seattlesolvers.solverslib.purepursuit.Path
Sets this path's motion profile to the provided PathMotionProfile.
setMovementSpeed(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the movement speed of this waypoint.
setMovementSpeed(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the movement speed of this waypoint.
setName(java.lang.String) - function in com.seattlesolvers.solverslib.command.CommandBase
 
setName(java.lang.String) - function in com.seattlesolvers.solverslib.command.CommandBase
 
setName(java.lang.String) - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
setName(java.lang.String) - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
setName(java.lang.String) - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
Changes the name of the sensor
setOffset(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
Sets an offset to be subtracted to the return value of getPosition()
setP(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setP(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setP(double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the proportional coefficient of the PID controller gain.
setPathTimeout(long) - function in com.seattlesolvers.solverslib.purepursuit.Path
Sets a timeout for the entire path.
setPathType(com.seattlesolvers.solverslib.purepursuit.types.PathType) - function in com.seattlesolvers.solverslib.purepursuit.Path
Sets the path type to the specified type.
setPID(double,double,double) - function in com.seattlesolvers.solverslib.controller.PIDController
 
setPID(double,double,double) - function in com.seattlesolvers.solverslib.controller.PIDController
 
setPID(double,double,double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the PID Controller gain parameters.
setPIDF(double,double,double,double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setPIDF(double,double,double,double) - function in com.seattlesolvers.solverslib.controller.PIDFController
 
setPosition(double) - function in com.seattlesolvers.solverslib.hardware.ServoEx
Sets the position of the servo to the specified location.
setPosition(double) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
Sets the position of the servo to the specified location.
setPosition(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversServo
 
setPositionBuffer(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Sets this waypoint's position buffer.
setPositionBuffer(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Sets this waypoint's position buffer.
setPositionCoefficient(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the proportional gain for the position controller.
setPositionCoefficient(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the proportional gain for the position controller.
setPositionCoefficient(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Set the proportional gain for the position controller.
setPositionTolerance(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the target tolerance
setPositionTolerance(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the target tolerance
setPositionTolerance(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Sets the target tolerance
setPower(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
setPower(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversCRServo
 
setPower(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
setPower(double) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
setPreferredAngle(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets and enables this waypoint's preferred angle.
setPreferredAngle(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets and enables this waypoint's preferred angle.
setPwm(com.qualcomm.robotcore.hardware.PwmControl.PwmRange) - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
 
setPwm(com.qualcomm.robotcore.hardware.PwmControl.PwmRange) - function in com.seattlesolvers.solverslib.solversHardware.SolversCRServo
 
setRange(double,double) - function in com.seattlesolvers.solverslib.drivebase.DifferentialDrive
Sets the range of the input, see RobotDrive for more info.
setRange(double,double) - function in com.seattlesolvers.solverslib.drivebase.HDrive
Sets the range of the input, see RobotDrive for more info.
setRange(double,double) - function in com.seattlesolvers.solverslib.drivebase.MecanumDrive
Sets the range of the input, see RobotDrive for more info.
setRange(double,double) - function in com.seattlesolvers.solverslib.drivebase.RobotDrive
Sets the clipped range for the drive inputs.
setRange(T,com.seattlesolvers.solverslib.drivebase.Range) - function in com.seattlesolvers.solverslib.drivebase.RobotDriveExtKt
 
setRange(double,double) - function in com.seattlesolvers.solverslib.hardware.ServoEx
Sets the range of the servo at specified angles in degrees.
setRange(double,double,org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.ServoEx
Sets the range of the servo at specified angles.
setRange(double,double) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
Sets the range of the servo at specified angles in degrees.
setRange(double,double,org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.SimpleServo
Sets the range of the servo at specified angles.
setRange(com.seattlesolvers.solverslib.hardware.Range) - function in com.seattlesolvers.solverslib.hardware.SimpleServoExtKt
 
setRetraceSettings(double,double) - function in com.seattlesolvers.solverslib.purepursuit.Path
Configures the retrace settings.
setReversed(boolean) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Sets the reversed flag of the trajectory.
setRightSideInverted(boolean) - function in com.seattlesolvers.solverslib.drivebase.DifferentialDrive
Sets the right side inversion factor to the specified boolean.
setRightSideInverted(boolean) - function in com.seattlesolvers.solverslib.drivebase.MecanumDrive
Sets the right side inversion factor to the specified boolean.
setRotationBuffer(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Sets this waypoint's rotation buffer.
setRotationBuffer(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Sets this waypoint's rotation buffer.
setRunMode(com.seattlesolvers.solverslib.hardware.motors.Motor.RunMode) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the RunMode of the motor
setRunMode(com.seattlesolvers.solverslib.hardware.motors.Motor.RunMode) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the RunMode of the motor
setRunMode(com.seattlesolvers.solverslib.hardware.motors.Motor.RunMode) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Sets the RunMode of the motor
setServoEncoder(com.qualcomm.robotcore.hardware.AnalogInput) - function in com.seattlesolvers.solverslib.solversHardware.SolversAxonServo
Sets the servo encoder.
setSetPoint(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
Sets the setpoint for the PIDFController
setSetPoint(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
Sets the setpoint for the PIDFController
setStackTrace(kotlin.Array) - function in java.lang.Throwable
 
setStartVelocity(double) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryConfig
Sets the start velocity of the trajectory.
setSubsystem(java.lang.String) - function in com.seattlesolvers.solverslib.command.CommandBase
 
setSubsystem(java.lang.String) - function in com.seattlesolvers.solverslib.command.CommandBase
 
setSubsystem(java.lang.String) - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
setSubsystem(java.lang.String) - function in com.seattlesolvers.solverslib.command.SubsystemBase
 
setTarget(double) - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
Change the target value
setTargetDistance(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the target distance for the motor to the desired target.
setTargetDistance(double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the target distance for the motor to the desired target.
setTargetDistance(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Sets the target distance for the motor to the desired target.
setTargetPosition(int) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the target position for the motor to the desired target.
setTargetPosition(int) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Sets the target position for the motor to the desired target.
setTargetPosition(int) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Sets the target position for the motor to the desired target.
setTimeout(long) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the timeout period of this waypoint.
setTimeout(long) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the timeout period of this waypoint.
setTolerance(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
Sets the error which is considered tolerable for use with atSetPoint.
setTolerance(double) - function in com.seattlesolvers.solverslib.controller.PIDFController
Sets the error which is considered tolerable for use with atSetPoint.
setTolerance(double,double) - function in com.seattlesolvers.solverslib.controller.PIDFController
Sets the error which is considered tolerable for use with atSetPoint.
setTolerance(double,double) - function in com.seattlesolvers.solverslib.controller.PIDFController
Sets the error which is considered tolerable for use with atSetPoint.
setTolerance(double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the error which is considered tolerable for use with atSetpoint().
setTolerance(double,double) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.ProfiledPIDController
Sets the error which is considered tolerable for use with atSetpoint().
setTolerance(com.seattlesolvers.solverslib.geometry.Pose2d) - function in com.seattlesolvers.solverslib.controller.wpilibcontroller.RamseteController
Sets the pose error which is considered tolerable for use with atReference().
setTraversed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.EndWaypoint
Sets this endpoint as traversed.
setTraversed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Tells the waypoint that it has been traversed.
setTraversed() - function in com.seattlesolvers.solverslib.purepursuit.waypoints.PointTurnWaypoint
Tells the waypoint that it has been traversed.
setTurnSpeed(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the turn speed of this waypoint.
setTurnSpeed(double) - function in com.seattlesolvers.solverslib.purepursuit.waypoints.GeneralWaypoint
Sets the turn speed of this waypoint.
setUnit(org.firstinspires.ftc.robotcore.external.navigation.DistanceUnit) - function in com.seattlesolvers.solverslib.hardware.SensorDistanceEx.DistanceTarget
Changes the unit of measurement
setVelocity(double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorEx
 
setVelocity(double,org.firstinspires.ftc.robotcore.external.navigation.AngleUnit) - function in com.seattlesolvers.solverslib.hardware.motors.MotorEx
Sets the velocity of the motor to an angular rate
setVeloCoefficients(double,double,double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the velocity pid coefficients for the motor.
setVeloCoefficients(double,double,double) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Set the velocity pid coefficients for the motor.
setVeloCoefficients(double,double,double) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Set the velocity pid coefficients for the motor.
setWaypointTimeouts(long) - function in com.seattlesolvers.solverslib.purepursuit.Path
Sets the timeout for each individual waypoint to be the value provided.
setWaypointTimeouts(kotlin.Array) - function in com.seattlesolvers.solverslib.purepursuit.Path
Sets the timeouts of n waypoints where n is the amount of arguments provided.
setZeroPowerBehavior(com.seattlesolvers.solverslib.hardware.motors.Motor.ZeroPowerBehavior) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
A wrapper method for the zero power behavior
setZeroPowerBehavior(com.seattlesolvers.solverslib.hardware.motors.Motor.ZeroPowerBehavior) - function in com.seattlesolvers.solverslib.hardware.motors.Motor
A wrapper method for the zero power behavior
setZeroPowerBehavior(com.seattlesolvers.solverslib.hardware.motors.Motor.ZeroPowerBehavior) - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
A wrapper method for the zero power behavior
setZeroPowerBehavior(com.qualcomm.robotcore.hardware.DcMotor.ZeroPowerBehavior) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotor
 
setZeroPowerBehavior(com.qualcomm.robotcore.hardware.DcMotor.ZeroPowerBehavior) - function in com.seattlesolvers.solverslib.solversHardware.SolversMotorEx
 
SHARE - enum entry in com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button
 
SimpleMotorFeedforward - class in com.seattlesolvers.solverslib.controller.wpilibcontroller
A helper class that computes feedforward outputs for a simple permanent-magnet DC motor.
SimpleServo - class in com.seattlesolvers.solverslib.hardware
 
SimpleServoExtKt - class in com.seattlesolvers.solverslib.hardware
 
size() - function in java.util.ArrayList
 
size() - function in java.util.TreeMap
 
sleep(long) - function in com.qualcomm.robotcore.eventloop.opmode.LinearOpMode
 
SolversAxonServo - class in com.seattlesolvers.solverslib.solversHardware
A wrapper CRServo class for axon servos that has two goals.
SolversCRServo - class in com.seattlesolvers.solverslib.solversHardware
A wrapper servo class that provides caching to avoid unnecessary setPower() calls.
SolversMotor - class in com.seattlesolvers.solverslib.solversHardware
A wrapper DcMotor class that provides caching to avoid unnecessary setPower() calls.
SolversMotorEx - class in com.seattlesolvers.solverslib.solversHardware
A wrapper DcMotor class that provides caching to avoid unnecessary setPower() calls.
SolversServo - class in com.seattlesolvers.solverslib.solversHardware
A wrapper servo class that provides caching to avoid unnecessary setPosition() calls.
sort(java.util.Comparator) - function in java.util.ArrayList
 
Spline - class in com.seattlesolvers.solverslib.spline
Represents a two-dimensional parametric spline that interpolates between two points.
Spline.ControlVector - class in com.seattlesolvers.solverslib.spline.Spline
Represents a control vector for a spline.
SplineHelper - class in com.seattlesolvers.solverslib.spline
 
SplineParameterizer - class in com.seattlesolvers.solverslib.spline
Class used to parameterize a spline by its arc length.
SplineParameterizer.MalformedSplineException - class in com.seattlesolvers.solverslib.spline.SplineParameterizer
 
splinePointsFromSplines(kotlin.Array) - function in com.seattlesolvers.solverslib.trajectory.TrajectoryGenerator
Generate spline points from a vector of splines by parameterizing the splines.
spliterator() - function in java.lang.Iterable
 
spliterator() - function in java.util.ArrayList
 
SQUARE - enum entry in com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button
 
start() - function in com.qualcomm.robotcore.eventloop.opmode.LinearOpMode
 
START - enum entry in com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button
 
START - enum entry in com.seattlesolvers.solverslib.purepursuit.types.WaypointType
 
start() - function in com.seattlesolvers.solverslib.util.Timing.Timer
Starts this timer.
StartEndCommand - class in com.seattlesolvers.solverslib.command
A command that runs a given runnable when it is initialized, and another runnable when it ends.
StartWaypoint - class in com.seattlesolvers.solverslib.purepursuit.waypoints
A start waypoint represents the first waypoint in a path.
stateJustChanged() - function in com.seattlesolvers.solverslib.gamepad.ButtonReader
Checks if the button state has changed
stateJustChanged() - function in com.seattlesolvers.solverslib.gamepad.ButtonReader
Checks if the button state has changed
stateJustChanged(com.seattlesolvers.solverslib.gamepad.GamepadKeys.Button) - function in com.seattlesolvers.solverslib.gamepad.GamepadEx
Returns if the button's state has just changed
stateJustChanged() - function in com.seattlesolvers.solverslib.gamepad.KeyReader
Checks if the button state has changed
stateJustChanged() - function in com.seattlesolvers.solverslib.gamepad.TriggerReader
Checks if the button state has changed
stop() - function in com.qualcomm.robotcore.eventloop.opmode.LinearOpMode
 
stop() - function in com.seattlesolvers.solverslib.command.old.Subsystem
Halts the performance of the subsystem, bringing all hardware devices to a stop.
stop() - function in com.seattlesolvers.solverslib.drivebase.DifferentialDrive
Stop the motors.
stop() - function in com.seattlesolvers.solverslib.drivebase.HDrive
 
stop() - function in com.seattlesolvers.solverslib.drivebase.MecanumDrive
Stop the motors.
stop() - function in com.seattlesolvers.solverslib.drivebase.RobotDrive
 
stop() - function in com.seattlesolvers.solverslib.hardware.motors.CRServo
 
stopAndResetEncoder() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Resets the internal position of the motor.
stopAndResetEncoder() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Resets the internal position of the motor.
stopAndResetEncoder() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Resets the internal position of the motor.
stopMotor() - function in com.seattlesolvers.solverslib.hardware.motors.CRServo
Stops motor movement.
stopMotor() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Stops motor movement.
stopMotor() - function in com.seattlesolvers.solverslib.hardware.motors.Motor
Stops motor movement.
stopMotor() - function in com.seattlesolvers.solverslib.hardware.motors.MotorGroup
Stops all motors in the group.
stream() - function in java.util.Collection
 
subList(int,int) - function in java.util.ArrayList
 
subMap(K,K) - function in java.util.TreeMap
 
subMap(K,boolean,K,boolean) - function in java.util.TreeMap
 
Subsystem - class in com.seattlesolvers.solverslib.command
A robot subsystem.
Subsystem - class in com.seattlesolvers.solverslib.command.old
The interface for a custom susbsystem.
SubsystemBase - class in com.seattlesolvers.solverslib.command
A base for subsystems and provides a more intuitive method for setting the default command.
SwerveDriveKinematics - class in com.seattlesolvers.solverslib.kinematics.wpilibkinematics
Helper class that converts a chassis velocity (dx, dy, and dtheta components) into individual module states (speed and angle).
SwerveDriveKinematicsConstraint - class in com.seattlesolvers.solverslib.trajectory.constraint
A class that enforces constraints on the swerve drive kinematics.
SwerveDriveOdometry - class in com.seattlesolvers.solverslib.kinematics.wpilibkinematics
Class for swerve drive odometry.
SwerveModuleState - class in com.seattlesolvers.solverslib.kinematics.wpilibkinematics
Represents the state of one swerve module.
A  B  C  D  E  F  G  H  I  K  L  M  N  O  P  Q  R  S  T  U  V  W  X  Y