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

A

acc - Variable in class com.first.team2052.lib.TrajectoryFollower.TrajectorySetpoint
 
AdaptivePurePursuitController - Class in com.first.team2052.lib.path
Implements an adaptive pure pursuit controller.
AdaptivePurePursuitController(double, double, double, Path, boolean, double) - Constructor for class com.first.team2052.lib.path.AdaptivePurePursuitController
 
AdaptivePurePursuitController.Circle - Class in com.first.team2052.lib.path
 
addLoopable(Loopable) - Method in class com.first.team2052.lib.ControlLoop
 

C

calculate(double) - Method in class com.first.team2052.lib.SynchronousPID
Read the input, calculate the output accordingly, and write to the output.
calculate(double) - Method in class com.first.team2052.lib.TrajectoryFollower
 
center - Variable in class com.first.team2052.lib.path.AdaptivePurePursuitController.Circle
 
Circle(Translation2d, double, boolean) - Constructor for class com.first.team2052.lib.path.AdaptivePurePursuitController.Circle
 
clamped_index - Variable in class com.first.team2052.lib.path.PathSegment.ClosestPointReport
 
closest_point - Variable in class com.first.team2052.lib.path.PathSegment.ClosestPointReport
 
ClosestPointReport() - Constructor for class com.first.team2052.lib.path.PathSegment.ClosestPointReport
 
com.first.team2052.lib - package com.first.team2052.lib
 
com.first.team2052.lib.interpolables - package com.first.team2052.lib.interpolables
 
com.first.team2052.lib.path - package com.first.team2052.lib.path
 
com.first.team2052.lib.vec - package com.first.team2052.lib.vec
 
compareTo(InterpolatingDouble) - Method in class com.first.team2052.lib.interpolables.InterpolatingDouble
 
configure(double, double, double, double, double, TrajectoryFollower.TrajectoryConfig) - Method in class com.first.team2052.lib.TrajectoryFollower
 
ControlLoop - Class in com.first.team2052.lib
 
ControlLoop(double) - Constructor for class com.first.team2052.lib.ControlLoop
 
cos() - Method in class com.first.team2052.lib.vec.Rotation2d
 
cos_angle_ - Variable in class com.first.team2052.lib.vec.Rotation2d
 

D

Delta(double, double, double) - Constructor for class com.first.team2052.lib.vec.RigidTransform2d.Delta
 
Delta(RigidTransform2d, RigidTransform2d) - Constructor for class com.first.team2052.lib.vec.RigidTransform2d.Delta
 
distance - Variable in class com.first.team2052.lib.path.PathSegment.ClosestPointReport
 
dotProduct(Translation2d) - Method in class com.first.team2052.lib.path.PathSegment
 
dt - Variable in class com.first.team2052.lib.TrajectoryFollower.TrajectoryConfig
 
dtheta - Variable in class com.first.team2052.lib.vec.RigidTransform2d.Delta
change in theta
dx - Variable in class com.first.team2052.lib.vec.RigidTransform2d.Delta
change in x
dy - Variable in class com.first.team2052.lib.vec.RigidTransform2d.Delta
change in y

E

extrapolate(Translation2d, double) - Method in class com.first.team2052.lib.vec.Translation2d
 

F

flip() - Method in class com.first.team2052.lib.FlipFlopLatch
 
FlipFlopLatch - Class in com.first.team2052.lib
 
FlipFlopLatch() - Constructor for class com.first.team2052.lib.FlipFlopLatch
 
FlipFlopLatch(boolean) - Constructor for class com.first.team2052.lib.FlipFlopLatch
 
fromDegrees(double) - Static method in class com.first.team2052.lib.vec.Rotation2d
 
fromRadians(double) - Static method in class com.first.team2052.lib.vec.Rotation2d
 
fromRotation(Rotation2d) - Static method in class com.first.team2052.lib.vec.RigidTransform2d
generates a rigidTransform with the given rotation component and 0 translation
fromTranslation(Translation2d) - Static method in class com.first.team2052.lib.vec.RigidTransform2d
generates a rigidTransform with the given translation component and 0 rotation
fromVelocity(RigidTransform2d.Delta) - Static method in class com.first.team2052.lib.vec.RigidTransform2d
Obtain a new RigidTransform2d from a (constant curvature) velocity.

G

get() - Method in class com.first.team2052.lib.FlipFlopLatch
 
get() - Method in class com.first.team2052.lib.SynchronousPID
Return the current PID result This is always centered on zero and constrained the the max and min outs
getAirPressurePsi() - Method in class com.first.team2052.lib.RevRoboticsPressureSensor
 
getClosestPoint(Translation2d) - Method in class com.first.team2052.lib.path.PathSegment
 
getConfig() - Method in class com.first.team2052.lib.TrajectoryFollower
 
getCurrentSetpoint() - Method in class com.first.team2052.lib.TrajectoryFollower
 
getD() - Method in class com.first.team2052.lib.SynchronousPID
Get the Differential coefficient
getDegrees() - Method in class com.first.team2052.lib.vec.Rotation2d
 
getEnd() - Method in class com.first.team2052.lib.path.PathSegment
 
getError() - Method in class com.first.team2052.lib.SynchronousPID
Returns the current difference of the input from the setpoint
getGoal() - Method in class com.first.team2052.lib.TrajectoryFollower
 
getI() - Method in class com.first.team2052.lib.SynchronousPID
Get the Integral coefficient
getInterpolated(K) - Method in class com.first.team2052.lib.interpolables.InterpolatingTreeMap
 
getLength() - Method in class com.first.team2052.lib.path.PathSegment
 
getLookaheadPoint(Translation2d, double) - Method in class com.first.team2052.lib.path.Path
 
getMarkersCrossed() - Method in class com.first.team2052.lib.path.AdaptivePurePursuitController
 
getMarkersCrossed() - Method in class com.first.team2052.lib.path.Path
 
getP() - Method in class com.first.team2052.lib.SynchronousPID
Get the Proportional coefficient
getRadians() - Method in class com.first.team2052.lib.vec.Rotation2d
 
getRemainingLength() - Method in class com.first.team2052.lib.path.Path
 
getRotation() - Method in class com.first.team2052.lib.vec.RigidTransform2d
 
getSetpoint() - Method in class com.first.team2052.lib.SynchronousPID
Returns the current setpoint of the PID controller
getSpeed() - Method in class com.first.team2052.lib.path.PathSegment
 
getStart() - Method in class com.first.team2052.lib.path.PathSegment
 
getState() - Method in class com.first.team2052.lib.SynchronousPID
 
getTranslation() - Method in class com.first.team2052.lib.vec.RigidTransform2d
 
getType() - Method in class com.first.team2052.lib.SynchronousPID
 
getX() - Method in class com.first.team2052.lib.vec.Translation2d
 
getY() - Method in class com.first.team2052.lib.vec.Translation2d
 

H

hasPassedTime(double) - Method in class com.first.team2052.lib.KnightTimer
 

I

index - Variable in class com.first.team2052.lib.path.PathSegment.ClosestPointReport
 
Interpolable<T> - Interface in com.first.team2052.lib.interpolables
Interpolable is an interface used by an Interpolating Tree as the Value type.
interpolate(T, double) - Method in interface com.first.team2052.lib.interpolables.Interpolable
Interpolates between this value and an other value according to a given parameter.
interpolate(InterpolatingDouble, double) - Method in class com.first.team2052.lib.interpolables.InterpolatingDouble
 
interpolate(double) - Method in class com.first.team2052.lib.path.PathSegment
 
interpolate(RigidTransform2d, double) - Method in class com.first.team2052.lib.vec.RigidTransform2d
Do linear interpolation of this transform (there are more accurate ways using constant curvature, but this is good enough).
interpolate(Rotation2d, double) - Method in class com.first.team2052.lib.vec.Rotation2d
 
interpolate(Translation2d, double) - Method in class com.first.team2052.lib.vec.Translation2d
 
InterpolatingDouble - Class in com.first.team2052.lib.interpolables
A Double that can be interpolated using the InterpolatingTreeMap.
InterpolatingDouble(Double) - Constructor for class com.first.team2052.lib.interpolables.InterpolatingDouble
 
InterpolatingTreeMap<K extends InverseInterpolable<K> & java.lang.Comparable<K>,V extends Interpolable<V>> - Class in com.first.team2052.lib.interpolables
Interpolating Tree Maps are used to get values at points that are not defined by making a guess from points that are defined.
InterpolatingTreeMap(int) - Constructor for class com.first.team2052.lib.interpolables.InterpolatingTreeMap
 
InterpolatingTreeMap() - Constructor for class com.first.team2052.lib.interpolables.InterpolatingTreeMap
 
inverse() - Method in class com.first.team2052.lib.vec.RigidTransform2d
The inverse of this transform "undoes" the effect of translating by this transform.
inverse() - Method in class com.first.team2052.lib.vec.Rotation2d
The inverse of a Rotation2d "undoes" the effect of this rotation.
inverse() - Method in class com.first.team2052.lib.vec.Translation2d
The inverse simply means a Translation2d that "undoes" this object.
InverseInterpolable<T> - Interface in com.first.team2052.lib.interpolables
InverseInterpolable is an interface used by an Interpolating Tree as the Key type.
inverseInterpolate(InterpolatingDouble, InterpolatingDouble) - Method in class com.first.team2052.lib.interpolables.InterpolatingDouble
 
inverseInterpolate(T, T) - Method in interface com.first.team2052.lib.interpolables.InverseInterpolable
Given this point (lower), a query point (query), and an upper point (upper), estimate how far (on [0, 1]) between 'lower' and 'upper' the query point lies.
isDone() - Method in class com.first.team2052.lib.path.AdaptivePurePursuitController
 
isFinishedTrajectory() - Method in class com.first.team2052.lib.TrajectoryFollower
 
isRunning() - Method in class com.first.team2052.lib.KnightTimer
 

J

joinPath(RigidTransform2d, Translation2d) - Static method in class com.first.team2052.lib.path.AdaptivePurePursuitController
 

K

kEpsilon - Static variable in class com.first.team2052.lib.path.PathSegment
 
kEpsilon - Static variable in class com.first.team2052.lib.vec.Rotation2d
 
KnightTimer - Class in com.first.team2052.lib
There is no running condition for the regular time in WPILib Why? No clue.
KnightTimer() - Constructor for class com.first.team2052.lib.KnightTimer
 
kSegmentCompletePercentage - Static variable in class com.first.team2052.lib.path.Path
 

L

Loopable - Interface in com.first.team2052.lib
 

M

marker - Variable in class com.first.team2052.lib.path.Path.Waypoint
 
max_acc - Variable in class com.first.team2052.lib.TrajectoryFollower.TrajectoryConfig
 
max_vel - Variable in class com.first.team2052.lib.TrajectoryFollower.TrajectoryConfig
 
mEnd - Variable in class com.first.team2052.lib.path.PathSegment
 
mLength - Variable in class com.first.team2052.lib.path.PathSegment
 
mMarkersCrossed - Variable in class com.first.team2052.lib.path.Path
 
mSegments - Variable in class com.first.team2052.lib.path.Path
 
mSpeed - Variable in class com.first.team2052.lib.path.PathSegment
 
mStart - Variable in class com.first.team2052.lib.path.PathSegment
 
mStartToEnd - Variable in class com.first.team2052.lib.path.PathSegment
 
mWaypoints - Variable in class com.first.team2052.lib.path.Path
 

N

norm() - Method in class com.first.team2052.lib.vec.Translation2d
The "norm" of a transform is the Euclidean distance in x and y.
normalize() - Method in class com.first.team2052.lib.vec.Rotation2d
From trig, we know that sin^2 + cos^2 == 1, but as we do math on this object we might accumulate rounding errors.

O

onStart() - Method in interface com.first.team2052.lib.Loopable
 
onStop() - Method in interface com.first.team2052.lib.Loopable
 
onTarget(double) - Method in class com.first.team2052.lib.SynchronousPID
Return true if the error is within the tolerance

P

Path - Class in com.first.team2052.lib.path
A Path is a recording of the path that the robot takes.
Path(List<Path.Waypoint>) - Constructor for class com.first.team2052.lib.path.Path
 
Path.Waypoint - Class in com.first.team2052.lib.path
A point along the Path, which consists of the location, the speed, and a string marker (that future code can identify).
PathSegment - Class in com.first.team2052.lib.path
 
PathSegment(Translation2d, Translation2d, double) - Constructor for class com.first.team2052.lib.path.PathSegment
 
PathSegment.ClosestPointReport - Class in com.first.team2052.lib.path
 
PathSegment.Sample - Class in com.first.team2052.lib.path
 
pos - Variable in class com.first.team2052.lib.TrajectoryFollower.TrajectorySetpoint
 
position - Variable in class com.first.team2052.lib.path.Path.Waypoint
 
put(K, V) - Method in class com.first.team2052.lib.interpolables.InterpolatingTreeMap
Inserts a key value pair, and trims the tree if a max size is specified
putAll(Map<? extends K, ? extends V>) - Method in class com.first.team2052.lib.interpolables.InterpolatingTreeMap
 

R

radius - Variable in class com.first.team2052.lib.path.AdaptivePurePursuitController.Circle
 
reset() - Method in class com.first.team2052.lib.SynchronousPID
Reset all internal terms.
resetIntegrator() - Method in class com.first.team2052.lib.SynchronousPID
 
RevRoboticsPressureSensor - Class in com.first.team2052.lib
Wraps an analog input for a Rev Robotics Analog Pressure sensor.
RevRoboticsPressureSensor(int) - Constructor for class com.first.team2052.lib.RevRoboticsPressureSensor
 
RigidTransform2d - Class in com.first.team2052.lib.vec
Represents a 2d pose (rigid transform) containing translational and rotational elements.
RigidTransform2d() - Constructor for class com.first.team2052.lib.vec.RigidTransform2d
default rigidTransform has 0 rotation and translation
RigidTransform2d(Translation2d, Rotation2d) - Constructor for class com.first.team2052.lib.vec.RigidTransform2d
 
RigidTransform2d(RigidTransform2d) - Constructor for class com.first.team2052.lib.vec.RigidTransform2d
makes a copy of the given rigidTransform
RigidTransform2d.Delta - Class in com.first.team2052.lib.vec
Movement along an arc at constant curvature and velocity.
rotateBy(Rotation2d) - Method in class com.first.team2052.lib.vec.Rotation2d
We can rotate this Rotation2d by adding together the effects of it and another rotation.
rotateBy(Rotation2d) - Method in class com.first.team2052.lib.vec.Translation2d
We can also rotate Translation2d's.
Rotation2d - Class in com.first.team2052.lib.vec
A rotation in a 2d coordinate frame represented a point on the unit circle (cosine and sine).
Rotation2d() - Constructor for class com.first.team2052.lib.vec.Rotation2d
 
Rotation2d(double, double, boolean) - Constructor for class com.first.team2052.lib.vec.Rotation2d
 
Rotation2d(Rotation2d) - Constructor for class com.first.team2052.lib.vec.Rotation2d
 
rotation_ - Variable in class com.first.team2052.lib.vec.RigidTransform2d
 

S

Sample(Translation2d, double) - Constructor for class com.first.team2052.lib.path.PathSegment.Sample
 
set(boolean) - Method in class com.first.team2052.lib.FlipFlopLatch
 
setConfig(TrajectoryFollower.TrajectoryConfig) - Method in class com.first.team2052.lib.TrajectoryFollower
 
setContinuous(boolean) - Method in class com.first.team2052.lib.SynchronousPID
Set the PID controller to consider the input to be continuous, Rather then using the max and min in as constraints, it considers them to be the same point and automatically calculates the shortest route to the setpoint.
setContinuous() - Method in class com.first.team2052.lib.SynchronousPID
Set the PID controller to consider the input to be continuous, Rather then using the max and min in as constraints, it considers them to be the same point and automatically calculates the shortest route to the setpoint.
setGoal(TrajectoryFollower.TrajectorySetpoint, double) - Method in class com.first.team2052.lib.TrajectoryFollower
 
setInputRange(double, double) - Method in class com.first.team2052.lib.SynchronousPID
Sets the maximum and minimum values expected from the input.
setOutputRange(double, double) - Method in class com.first.team2052.lib.SynchronousPID
Sets the minimum and maximum values to write.
setPID(double, double, double) - Method in class com.first.team2052.lib.SynchronousPID
Set the PID controller gain parameters.
setRotation(Rotation2d) - Method in class com.first.team2052.lib.vec.RigidTransform2d
 
setSetpoint(double) - Method in class com.first.team2052.lib.SynchronousPID
Set the setpoint for the PID controller
setTranslation(Translation2d) - Method in class com.first.team2052.lib.vec.RigidTransform2d
 
setX(double) - Method in class com.first.team2052.lib.vec.Translation2d
 
setY(double) - Method in class com.first.team2052.lib.vec.Translation2d
 
sin() - Method in class com.first.team2052.lib.vec.Rotation2d
 
sin_angle_ - Variable in class com.first.team2052.lib.vec.Rotation2d
 
speed - Variable in class com.first.team2052.lib.path.Path.Waypoint
 
speed - Variable in class com.first.team2052.lib.path.PathSegment.Sample
 
start() - Method in class com.first.team2052.lib.ControlLoop
 
start() - Method in class com.first.team2052.lib.KnightTimer
 
stop() - Method in class com.first.team2052.lib.ControlLoop
 
stop() - Method in class com.first.team2052.lib.KnightTimer
 
SynchronousPID - Class in com.first.team2052.lib
Class implements a PID Control Loop.
SynchronousPID() - Constructor for class com.first.team2052.lib.SynchronousPID
 
SynchronousPID(double, double, double) - Constructor for class com.first.team2052.lib.SynchronousPID
Allocate a PID object with the given constants for P, I, D

T

tan() - Method in class com.first.team2052.lib.vec.Rotation2d
 
TimeDelayedBoolean - Class in com.first.team2052.lib
 
TimeDelayedBoolean() - Constructor for class com.first.team2052.lib.TimeDelayedBoolean
 
toString() - Method in class com.first.team2052.lib.TrajectoryFollower.TrajectoryConfig
 
toString() - Method in class com.first.team2052.lib.TrajectoryFollower.TrajectorySetpoint
 
toString() - Method in class com.first.team2052.lib.vec.RigidTransform2d
 
toString() - Method in class com.first.team2052.lib.vec.Rotation2d
 
toString() - Method in class com.first.team2052.lib.vec.Translation2d
 
TrajectoryConfig() - Constructor for class com.first.team2052.lib.TrajectoryFollower.TrajectoryConfig
 
TrajectoryFollower - Class in com.first.team2052.lib
Use built in Talon SRX motion profiling, if you cannot, use this instead (for PWM speed controllers)
TrajectoryFollower() - Constructor for class com.first.team2052.lib.TrajectoryFollower
 
TrajectoryFollower.TrajectoryConfig - Class in com.first.team2052.lib
 
TrajectoryFollower.TrajectorySetpoint - Class in com.first.team2052.lib
 
TrajectorySetpoint() - Constructor for class com.first.team2052.lib.TrajectoryFollower.TrajectorySetpoint
 
transformBy(RigidTransform2d) - Method in class com.first.team2052.lib.vec.RigidTransform2d
Transforming this RigidTransform2d means first translating by other.translation and then rotating by other.rotation
translateBy(Translation2d) - Method in class com.first.team2052.lib.vec.Translation2d
We can compose Translation2d's by adding together the x and y shifts.
translation - Variable in class com.first.team2052.lib.path.PathSegment.Sample
 
Translation2d - Class in com.first.team2052.lib.vec
A translation in a 2d coordinate frame.
Translation2d() - Constructor for class com.first.team2052.lib.vec.Translation2d
 
Translation2d(double, double) - Constructor for class com.first.team2052.lib.vec.Translation2d
 
Translation2d(Translation2d) - Constructor for class com.first.team2052.lib.vec.Translation2d
 
translation_ - Variable in class com.first.team2052.lib.vec.RigidTransform2d
 
turn_right - Variable in class com.first.team2052.lib.path.AdaptivePurePursuitController.Circle
 

U

update(boolean) - Method in class com.first.team2052.lib.FlipFlopLatch
 
update() - Method in interface com.first.team2052.lib.Loopable
 
update(RigidTransform2d, double) - Method in class com.first.team2052.lib.path.AdaptivePurePursuitController
 
update(Translation2d) - Method in class com.first.team2052.lib.path.Path
 
update(boolean, double) - Method in class com.first.team2052.lib.TimeDelayedBoolean
 
updateStart(Translation2d) - Method in class com.first.team2052.lib.path.PathSegment
 

V

value - Variable in class com.first.team2052.lib.interpolables.InterpolatingDouble
 
vel - Variable in class com.first.team2052.lib.TrajectoryFollower.TrajectorySetpoint
 

W

Waypoint(Translation2d, double) - Constructor for class com.first.team2052.lib.path.Path.Waypoint
 
Waypoint(Translation2d, double, String) - Constructor for class com.first.team2052.lib.path.Path.Waypoint
 

X

x_ - Variable in class com.first.team2052.lib.vec.Translation2d
 

Y

y_ - Variable in class com.first.team2052.lib.vec.Translation2d
 
A C D E F G H I J K L M N O P R S T U V W X Y 
Skip navigation links