|
||||||||||
PREV NEXT | FRAMES NO FRAMES |
Uses of FrameVector in com.yobotics.simulationconstructionset |
---|
Methods in com.yobotics.simulationconstructionset with parameters of type FrameVector | |
---|---|
void |
FloatingJoint.getAngularAcceleration(FrameVector angularAccelerationToPack,
ReferenceFrame bodyFrame)
|
void |
FloatingJoint.getAngularVelocity(FrameVector angularVelocityToPack,
ReferenceFrame bodyFrame)
|
void |
FloatingJoint.getLinearAcceleration(FrameVector linearAccelerationToPack)
|
void |
FloatingJoint.getVelocity(FrameVector linearVelocityToPack)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.processedSensors |
---|
Methods in com.yobotics.simulationconstructionset.processedSensors that return FrameVector | |
---|---|
FrameVector |
ProcessedIMUSensorsReadOnlyInterface.getAcceleration(int imuIndex)
|
FrameVector |
ProcessedIMUSensorsReadOnlyInterface.getAngularAcceleration(int imuIndex)
|
FrameVector |
ProcessedIMUSensorsReadOnlyInterface.getAngularVelocity(int imuIndex)
|
Methods in com.yobotics.simulationconstructionset.processedSensors with parameters of type FrameVector | |
---|---|
void |
ProcessedIMUSensorsWriteOnlyInterface.setAcceleration(FrameVector accelerationInWorld,
int imuIndex)
|
void |
ProcessedBodyPositionSensorsWriteOnlyInterface.setBodyVelocity(FrameVector bodyVelocity)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.simulatedSensors |
---|
Methods in com.yobotics.simulationconstructionset.simulatedSensors that return FrameVector | |
---|---|
FrameVector |
ProcessedSensorsReadWrite.getAcceleration(int imuIndex)
|
FrameVector |
ProcessedSensorsReadWrite.getAngularAcceleration(int imuIndex)
|
FrameVector |
ProcessedSensorsReadWrite.getAngularVelocity(int imuIndex)
|
FrameVector |
SingleRigidBodyRobot.getBodyAcceleration()
|
FrameVector |
SingleRigidBodyRobot.getBodyAngularAccelerationInBodyFrame(ReferenceFrame bodyFrame)
|
FrameVector |
SingleRigidBodyRobot.getBodyAngularVelocityInBodyFrame(ReferenceFrame bodyFrame)
|
FrameVector |
SingleRigidBodyRobot.getBodyVelocity()
|
Methods in com.yobotics.simulationconstructionset.simulatedSensors with parameters of type FrameVector | |
---|---|
void |
ProcessedSensorsReadWrite.setAcceleration(FrameVector accelerationInWorld,
int imuIndex)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.util |
---|
Methods in com.yobotics.simulationconstructionset.util with parameters of type FrameVector | |
---|---|
void |
AxisAngleOrientationController.compute(FrameVector output,
FrameOrientation desiredOrientation,
FrameVector desiredAngularVelocity,
FrameVector currentAngularVelocity,
FrameVector feedForward)
|
void |
PositionController.compute(FrameVector output,
FramePoint desiredPosition,
FrameVector desiredVelocity,
FrameVector currentVelocity,
FrameVector feedForward)
|
void |
EuclideanPositionController.compute(FrameVector output,
FramePoint desiredPosition,
FrameVector desiredVelocity,
FrameVector currentVelocity,
FrameVector feedForward)
|
void |
CylindricalCoordinatesPositionController.compute(FrameVector output,
FramePoint desiredPosition,
FrameVector desiredVelocity,
FrameVector currentVelocity,
FrameVector feedForward)
|
void |
EuclideanPositionController.packPositionError(FrameVector ret)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.util.graphics |
---|
Methods in com.yobotics.simulationconstructionset.util.graphics with parameters of type FrameVector | |
---|---|
void |
DynamicGraphicVector.getVector(FrameVector frameVector)
|
void |
DynamicGraphicCylinder.getVector(FrameVector frameVector)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.util.math.filter |
---|
Methods in com.yobotics.simulationconstructionset.util.math.filter with parameters of type FrameVector | |
---|---|
void |
AlphaFilteredYoFrameVector.update(FrameVector vectorUnfiltered)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.util.math.frames |
---|
Methods in com.yobotics.simulationconstructionset.util.math.frames that return FrameVector | |
---|---|
FrameVector |
YoSpatialForceVector.getAngularPartAsFrameVectorCopy()
|
FrameVector |
YoFramePoint.getFrameVectorCopy()
|
FrameVector |
YoFrameVector.getFrameVectorCopy()
|
FrameVector |
YoSpatialForceVector.getLinearPartAsFrameVectorCopy()
|
Methods in com.yobotics.simulationconstructionset.util.math.frames with parameters of type FrameVector | |
---|---|
void |
YoFrameVectorBuffer.add(FramePoint framePoint,
FrameVector frameVector)
|
void |
YoFramePoint.add(FrameVector vector)
|
void |
YoFrameVector.add(FrameVector vector)
|
double |
YoFrameVector.dot(FrameVector vector)
|
boolean |
YoFramePoint.epsilonEquals(FrameVector frameVector,
double threshold)
|
boolean |
YoFrameVector.epsilonEquals(FrameVector frameVector,
double threshold)
|
void |
YoFramePoint.getFrameVector(FrameVector vector)
|
void |
YoFrameVector.getFrameVector(FrameVector vector)
|
void |
YoFrameVector.getFrameVectorAndChangeFrameOfPackedVector(FrameVector vector)
|
void |
YoSpatialForceVector.packAngularPart(FrameVector vectorToPack)
|
void |
YoSpatialForceVector.packLinearPart(FrameVector vectorToPack)
|
void |
YoFramePoint.scaleAdd(double scaleFactor,
FrameVector vector)
|
void |
YoFrameVector.scaleAdd(double scaleFactor,
FrameVector vector)
|
void |
YoFramePoint.set(FrameVector vector)
|
void |
YoFrameVector.set(FrameVector vector)
|
void |
YoFrameVectorInMultipleFrames.setFrameVector(FrameVector frameVector)
|
void |
YoFramePoint.sub(FrameVector vector)
|
void |
YoFrameVector.sub(FrameVector vector)
|
Uses of FrameVector in com.yobotics.simulationconstructionset.util.trajectory |
---|
Methods in com.yobotics.simulationconstructionset.util.trajectory that return FrameVector | |
---|---|
FrameVector |
YoSpline3D.getAcceleration()
|
FrameVector |
YoConcatenatedSplines.getAcceleration()
|
FrameVector |
YoSpline3D.getVelocity()
|
FrameVector |
YoConcatenatedSplines.getVelocity()
|
Methods in com.yobotics.simulationconstructionset.util.trajectory with parameters of type FrameVector | |
---|---|
void |
ParabolicPositionTrajectoryGenerator.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
|
void |
ParabolicCartesianTrajectoryGenerator.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
|
void |
CartesianTrajectoryGenerator.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
Packs the new desired position, velocity and acceleration. |
void |
AdjustableParabolicTrajectory.computeNextTick(FramePoint positionToPack,
FrameVector velocityToPack,
FrameVector accelerationToPack,
double deltaT)
|
void |
YoVelocityProvider.get(FrameVector velocityToPack)
|
void |
VectorProvider.get(FrameVector frameVectorToPack)
|
void |
CurrentLinearVelocityProvider.get(FrameVector frameVectorToPack)
|
void |
YoParabolicTrajectoryGenerator.initialize(FramePoint initialPosition,
FrameVector initialVelocity,
FramePoint finalPosition)
|
void |
ParabolicCartesianTrajectoryGenerator.initialize(FramePoint initialPosition,
FrameVector initialVelocity,
FrameVector initialAcceleration,
FramePoint finalDesiredPosition,
FrameVector finalDesiredVelocity)
|
void |
CartesianTrajectoryGenerator.initialize(FramePoint initialPosition,
FrameVector initialVelocity,
FrameVector initialAcceleration,
FramePoint finalDesiredPosition,
FrameVector finalDesiredVelocity)
initializes the trajectory generator with an initial position and velocity, final position and ground height. |
void |
YoParabolicTrajectoryGenerator.packAcceleration(FrameVector accelerationToPack)
|
void |
PositionTrajectoryGenerator.packAcceleration(FrameVector accelerationToPack)
|
void |
ParabolicPositionTrajectoryGenerator.packAcceleration(FrameVector accelerationToPack)
|
void |
ParabolicCartesianTrajectoryGenerator.packAcceleration(FrameVector accelerationToPack)
|
void |
PositionTrajectoryGenerator.packVelocity(FrameVector velocityToPack)
|
void |
ParabolicPositionTrajectoryGenerator.packVelocity(FrameVector velocityToPack)
|
void |
ParabolicCartesianTrajectoryGenerator.packVelocity(FrameVector velocityToPack)
|
void |
YoParabolicTrajectoryGenerator.packVelocity(FrameVector velocityToPack,
double parameter)
|
void |
YoVelocityProvider.set(FrameVector frameVector)
|
void |
YoSpline3D.setCubic(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FramePoint pf,
FrameVector pdf)
|
void |
YoConcatenatedSplines.setCubicLinearQuinticLinearCubic(double[] fixedPointTimes,
FramePoint[] fixedPointPositions,
FrameVector[] fixedPointVelocities,
double[] intermediateTimes)
|
void |
YoConcatenatedSplines.setCubicQuarticQuinticCubic(double[] times,
FramePoint[] positions,
FrameVector[] velocities)
|
void |
YoConcatenatedSplines.setCubicQuarticQuinticQuarticCubic(double[] times,
FramePoint[] positions,
FrameVector[] velocities)
|
void |
YoConcatenatedSplines.setCubicQuinticCubic(double[] times,
FramePoint[] positions,
FrameVector[] velocities)
|
void |
YoSpline3D.setCubicUsingFinalAccelerationButNotFinalPosition(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setLinearUsingFinalPositionAndVelocity(double t0,
double tf,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setLinearUsingInitialPositionAndVelocity(double t0,
double tf,
FramePoint p0,
FrameVector pd0)
|
void |
YoConcatenatedSplines.setQuadraticQuinticQuadratic(double[] times,
FramePoint[] positions,
FrameVector initialVelocity,
FrameVector finalVelocity)
|
void |
YoSpline3D.setQuadraticUsingFinalVelocity(double t0,
double tf,
FramePoint p0,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setQuadraticUsingInitialVelocity(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FramePoint pf)
|
void |
YoConcatenatedSplines.setQuarticLinearQuinticLinearQuartic(double[] fixedPointTimes,
FramePoint[] fixedPointPositions,
FrameVector[] fixedPointVelocities,
double[] intermediateTimes)
|
void |
YoConcatenatedSplines.setQuarticQuinticQuartic(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities)
|
void |
YoConcatenatedSplines.setQuarticQuinticQuartic(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities)
|
void |
YoSpline3D.setQuarticUsingFinalAcceleration(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setQuarticUsingInitialAcceleration(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setQuarticUsingIntermediateVelocity(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pd1,
FramePoint pf,
FrameVector pdf)
|
void |
YoSpline3D.setQuintic(double t0,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoConcatenatedSplines.setQuintics(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] accelerations)
|
void |
YoConcatenatedSplines.setQuintics(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] accelerations)
|
void |
YoConcatenatedSplines.setQuinticSexticQuinticUsingWaypointAndIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double ghostTime,
FramePoint ghostWaypoint,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticSexticQuinticUsingWaypointAndIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double ghostTime,
FramePoint ghostWaypoint,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticSexticQuinticUsingWaypointAndIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double ghostTime,
FramePoint ghostWaypoint,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticsUsingIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticsUsingIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setQuinticsUsingIntermediateVeloctiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoSpline3D.setQuinticUsingIntermediateVelocityAndAcceleration(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pd1,
FrameVector pdd1,
FramePoint pf,
FrameVector pdf)
|
void |
YoConcatenatedSplines.setSexticQuinticSexticUsingIntermediateVelocitiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] waypointAccelerations,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setSexticQuinticSexticUsingIntermediateVelocitiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] waypointAccelerations,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setSexticQuinticSexticUsingIntermediateVelocitiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] waypointAccelerations,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoConcatenatedSplines.setSexticQuinticSexticUsingIntermediateVelocitiesAndAccelerations(double[] times,
FramePoint[] positions,
FrameVector[] velocities,
FrameVector[] waypointAccelerations,
double[] intermediateTimes,
FrameVector[] intermediateVelocities,
FrameVector[] intermediateAccelerations)
|
void |
YoSpline3D.setSexticUsingWaypoint(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FramePoint p1,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setSexticUsingWaypointVelocityAndAccelerationAndFinalAcceleration(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pd1,
FrameVector pdd1,
FramePoint pf,
FrameVector pdf,
FrameVector pddf)
|
void |
YoSpline3D.setSexticUsingWaypointVelocityAndAccelerationAndInitialAcceleration(double t0,
double t1,
double tf,
FramePoint p0,
FrameVector pd0,
FrameVector pdd0,
FrameVector pd1,
FrameVector pdd1,
FramePoint pf,
FrameVector pdf)
|
Uses of FrameVector in us.ihmc.plotting |
---|
Method parameters in us.ihmc.plotting with type arguments of type FrameVector | |
---|---|
static PlotGraph2d |
PlotGraph2d.createFrameVectorPlotGraph2d(java.util.ArrayList<java.lang.Double> x,
java.util.ArrayList<FrameVector> frameVectors)
|
Uses of FrameVector in us.ihmc.utilities.kinematics |
---|
Methods in us.ihmc.utilities.kinematics that return FrameVector | |
---|---|
static FrameVector |
OrientationInterpolationCalculator.computeAngularAcceleration(FrameOrientation startOrientation,
FrameOrientation endOrientation,
double alphaDoubleDot)
Computes the angular acceleration for an interpolation between two orientations |
static FrameVector |
OrientationInterpolationCalculator.computeAngularVelocity(FrameOrientation startOrientation,
FrameOrientation endOrientation,
double alphaDot)
Computes the angular velocity for an interpolation between two orientations |
Uses of FrameVector in us.ihmc.utilities.listeners |
---|
Methods in us.ihmc.utilities.listeners with parameters of type FrameVector | |
---|---|
void |
Listener3DFramed.setVector(java.lang.Object key,
FramePoint from,
FrameVector frameVector)
|
Uses of FrameVector in us.ihmc.utilities.math |
---|
Methods in us.ihmc.utilities.math that return types with arguments of type FrameVector | |
---|---|
static java.util.ArrayList<FrameVector> |
MathTools.diff(java.util.ArrayList<FrameVector> array)
|
Method parameters in us.ihmc.utilities.math with type arguments of type FrameVector | |
---|---|
static java.util.ArrayList<FrameVector> |
MathTools.diff(java.util.ArrayList<FrameVector> array)
|
Uses of FrameVector in us.ihmc.utilities.math.geometry |
---|
Fields in us.ihmc.utilities.math.geometry declared as FrameVector | |
---|---|
FrameVector |
TranslationReferenceFrame.originVector
|
Methods in us.ihmc.utilities.math.geometry that return FrameVector | |
---|---|
FrameVector |
FrameVector.applyTransformCopy(javax.media.j3d.Transform3D transform)
|
FrameVector |
FrameVector.changeFrameCopy(ReferenceFrame desiredFrame)
Changes frame of this FrameVector to the given ReferenceFrame and returns a copy. |
FrameVector |
FrameLine.getDirectionInFrame(ReferenceFrame desiredFrame)
|
FrameVector |
FrameLine.getFrameDirection()
|
FrameVector |
FramePlane3d.getNormalCopy()
|
static FrameVector |
GeometryTools.getPerpendicularVectorFromLineToPoint(FramePoint point,
FramePoint lineStart,
FramePoint lineEnd,
FramePoint intersectionPoint)
Returns the Perpendicular Vector that is formed between a given Line (defined by two points) and a given point Returns zeros if point is located on the line |
static FrameVector |
GeometryTools.getPlaneNormalGivenThreePoints(FramePoint point1,
FramePoint point2,
FramePoint point3)
Returns the Normal of a plane that is defined by three points Returns a null if three points are linear, colinear, or equal Returns a null if two points are the same |
Methods in us.ihmc.utilities.math.geometry with parameters of type FrameVector | |
---|---|
void |
FramePoint.add(FramePoint point1,
FrameVector vector2)
|
void |
FrameVector.add(FrameVector frameVector)
|
void |
FramePoint.add(FrameVector frameVector)
|
void |
FramePoint.add(FrameVector vector1,
FramePoint point2)
|
void |
FrameVector.add(FrameVector vector1,
FrameVector vector2)
|
double |
FrameVector.angle(FrameVector frameVector)
|
static ReferenceFrame |
ReferenceFrame.constructReferenceFrameFromPointAndZAxis(java.lang.String frameName,
FramePoint point,
FrameVector zAxis)
|
void |
FrameVector.cross(FramePoint f1,
FrameVector f2)
|
void |
FrameVector.cross(FrameVector f1,
FramePoint f2)
|
void |
FrameVector.cross(FrameVector f1,
FrameVector f2)
|
double |
FrameVector.dot(FrameVector frameVector)
|
boolean |
FrameVector.epsilonEquals(FrameVector frameVector,
double threshold)
|
boolean |
FramePoint.epsilonEquals(FrameVector frameVector,
double threshold)
|
static void |
CylindricalCoordinatesCalculator.getAcceleration(FrameVector accelerationToPack,
ReferenceFrame frame,
double angle,
double angleDot,
double angleDDot,
double radius,
double radiusDot,
double radiusDDot,
double zDDot)
|
static double |
CylindricalCoordinatesCalculator.getAngularVelocity(FramePoint position,
FrameVector velocity)
|
void |
FrameTorus3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
void |
FrameShape3d.getClosestPointAndNormalAt(FramePoint closestPointToPack,
FrameVector normalToPack,
FramePoint pointInWorldToCheck)
Find the closest point on the surface of this shape to the given point as well as the surface normal at that point. |
void |
FrameRamp3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
void |
FrameEllipsoid3d.getClosestPointAndNormalAt(FramePoint closestPointToPack,
FrameVector normalToPack,
FramePoint pointInWorldToCheck)
|
void |
FrameCylinder3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
void |
FrameBox3d.getClosestPointAndNormalAt(FramePoint intersectionToPack,
FrameVector normalToPack,
FramePoint pointToCheck)
|
static void |
GeometryTools.getClosestPointsForTwoLines(FramePoint point1,
FrameVector vector1,
FramePoint point2,
FrameVector vector2,
FramePoint pointOnLine1,
FramePoint pointOnLine2)
|
static FramePoint |
GeometryTools.getIntersectionBetweenLineAndPlane(FramePoint pointOnPlane,
FrameVector planeNormal,
FramePoint lineStart,
FramePoint lineEnd)
Locates and returns the intersection between the given line and plane |
void |
FramePlane3d.getNormal(FrameVector normalToPack)
|
static double |
CylindricalCoordinatesCalculator.getRadialVelocity(FramePoint position,
FrameVector velocity)
|
static FrameOrientation |
GeometryTools.getTransform(FramePoint point,
FrameVector normal)
|
static void |
CylindricalCoordinatesCalculator.getVelocity(FrameVector velocityToPack,
ReferenceFrame frame,
double angle,
double angleDot,
double radius,
double radiusDot,
double zDot)
|
static void |
GeometryTools.getZPlanePerpendicularBisector(FramePoint lineStart,
FramePoint lineEnd,
FramePoint bisectorStart,
FrameVector bisectorDirection)
|
void |
FrameVector.scale(double scaleFactor,
FrameVector vector1)
Sets the value of this tuple to the scalar multiplication of vertor1 (this = s * t1). |
void |
FramePoint.scale(double scaleFactor,
FrameVector vector1)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FramePoint point1,
FrameVector vector2)
Sets the value of this tuple to the scalar multiplication of tuple t1 and then adds tuple t2 (this = s*v1 + t2). |
void |
FramePoint.scaleAdd(double scaleFactor,
FramePoint point1,
FrameVector vector2)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FrameVector vector1)
Sets the value of this tuple to the scalar multiplication of itself and then adds tuple t1 (this = s*this + t1). |
void |
FramePoint.scaleAdd(double scaleFactor,
FrameVector vector1)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FrameVector vector1,
FramePoint point2)
Sets the value of this tuple to the scalar multiplication of tuple t1 and then adds tuple t2 (this = s*v1 + t2). |
void |
FramePoint.scaleAdd(double scaleFactor,
FrameVector vector1,
FramePoint point2)
|
void |
FrameVector.scaleAdd(double scaleFactor,
FrameVector vector1,
FrameVector vector2)
Sets the value of this tuple to the scalar multiplication of tuple t1 and then adds tuple t2 (this = s*v1 + t2) |
void |
FramePoint.scaleAdd(double scaleFactor,
FrameVector vector1,
FrameVector vector2)
|
void |
FrameVector.set(FrameVector frameVector)
|
void |
FramePoint.set(FrameVector frameVector)
|
void |
FrameVector.setAndChangeFrame(FrameVector frameVector)
|
void |
FramePoint.setAndChangeFrame(FrameVector frameVector)
|
void |
FramePoint.sub(FramePoint point1,
FrameVector vector2)
|
void |
FrameVector.sub(FrameVector frameVector)
|
void |
FramePoint.sub(FrameVector frameVector)
|
void |
FramePoint.sub(FrameVector vector1,
FramePoint point2)
|
void |
FrameVector.sub(FrameVector vector1,
FrameVector vector2)
|
static double[] |
FrameVector.toArray(FrameVector[] frameVectors)
|
void |
TranslationReferenceFrame.updateTranslation(FrameVector frameVector)
|
void |
FrameVector.weightedAverage(FrameVector vector1,
FrameVector vector2,
double weightedAverage)
Sets this vector to be the weighted average of the two input vectors. |
Constructors in us.ihmc.utilities.math.geometry with parameters of type FrameVector | |
---|---|
FrameLine(FramePoint origin,
FrameVector direction)
|
|
FramePlane3d(FrameVector normal,
FramePoint point)
|
|
FramePoint(FrameVector frameVector)
|
|
FramePoint(FrameVector frameVector,
java.lang.String name)
|
|
FrameVector(FrameVector frameVector)
FrameVector A normal vector associated with a specific reference frame |
|
FrameVector(FrameVector frameVector,
java.lang.String name)
|
|
TranslationFrame(FrameVector frameVector)
|
Uses of FrameVector in us.ihmc.utilities.math.trajectories |
---|
Methods in us.ihmc.utilities.math.trajectories that return FrameVector | |
---|---|
FrameVector |
WaypointMotionGenerator.getCurrentDesiredAcceleration(double timeInMove)
|
FrameVector |
WaypointMotionGenerator.getCurrentDesiredVelocity(double timeInMove)
|
Constructors in us.ihmc.utilities.math.trajectories with parameters of type FrameVector | |
---|---|
PointSpliner(java.util.ArrayList<FramePoint> listOfPoints,
FrameVector initialHeading,
FrameVector finalHeading)
|
Uses of FrameVector in us.ihmc.utilities.screwTheory |
---|
Methods in us.ihmc.utilities.screwTheory that return FrameVector | |
---|---|
static FrameVector |
CenterOfMassJacobianTest.computeCenterOfMassVelocityNumerically(SixDoFJoint sixDoFJoint,
java.util.ArrayList<RevoluteJoint> revoluteJoints,
RigidBody rootBody,
RigidBody[] rigidBodiesToUse,
ReferenceFrame referenceFrame)
|
FrameVector |
SpatialForceVector.getAngularPartAsFrameVectorCopy()
|
FrameVector |
Twist.getBodyOriginLinearVelocityInBaseFrame()
Returns the linear velocity of the body frame with respect to the base frame, expressed in the base frame. |
FrameVector |
RevoluteJoint.getJointAxis()
|
FrameVector |
SpatialForceVector.getLinearPartAsFrameVectorCopy()
|
Methods in us.ihmc.utilities.screwTheory with parameters of type FrameVector | |
---|---|
void |
ThreeDoFAngularAccelerationCalculator.compute(FrameVector desiredAngularAcceleration)
|
void |
PointJacobianConvectiveTermCalculator.compute(PointJacobian pointJacobian,
FrameVector pPointVelocity)
|
void |
SpatialAccelerationVector.packAccelerationOfPointFixedInBodyFrame(Twist twist,
FramePoint pointFixedInBodyFrame,
FrameVector frameVectorToPack)
Packs the linear acceleration of a point that is fixed in bodyFrame but is expressed in baseFrame, with respect to baseFrame, expressed in expressedInFrame |
void |
SpatialMotionVector.packAngularPart(FrameVector vectorToPack)
Packs an existing FrameVector with the angular velocity part |
void |
SpatialForceVector.packAngularPart(FrameVector vectorToPack)
Packs an existing FrameVector with the angular part. |
void |
Twist.packBodyOriginLinearPartInBaseFrame(FrameVector frameVectorToPack)
Packs a version of the linear velocity, rotated to the base frame. |
void |
CenterOfMassJacobian.packCenterOfMassVelocity(FrameVector centerOfMassVelocityToPack)
|
void |
CenterOfMassAccelerationCalculator.packCoMAcceleration(FrameVector comAccelerationToPack)
|
void |
SphericalJoint.packJointTorque(FrameVector jointTorqueToPack)
|
void |
SpatialAccelerationCalculator.packLinearAccelerationOfBodyFixedPoint(FrameVector linearAccelerationToPack,
RigidBody body,
FramePoint bodyFixedPoint)
|
void |
SpatialAccelerationCalculator.packLinearAccelerationOfBodyFixedPoint(FrameVector linearAccelerationToPack,
RigidBody base,
RigidBody body,
FramePoint bodyFixedPoint)
|
void |
SpatialMotionVector.packLinearPart(FrameVector vectorToPack)
Packs an existing FrameVector with the linear velocity part |
void |
SpatialForceVector.packLinearPart(FrameVector vectorToPack)
Packs an existing FrameVector with the linear part. |
void |
Twist.packVelocityOfPointFixedInBodyFrame(FrameVector frameVectorToPack,
FramePoint pointFixedInBodyFrame)
Packs the linear velocity of a point that is fixed in bodyFrame but is expressed in baseFrame, with respect to baseFrame, expressed in expressedInFrame |
void |
SphericalJoint.setAcceleration(FrameVector jointAngularAcceleration)
|
void |
SpatialAccelerationVector.setBasedOnOriginAcceleration(FrameVector angularAcceleration,
FrameVector originAcceleration,
Twist twistOfBodyWithRespectToBase)
|
void |
SphericalJoint.setDesiredAcceleration(FrameVector jointAngularAccelerationDesired)
|
void |
SphericalJoint.setJointAngularVelocity(FrameVector jointAngularVelocity)
|
void |
SphericalJoint.setJointTorque(FrameVector jointTorque)
|
Constructors in us.ihmc.utilities.screwTheory with parameters of type FrameVector | |
---|---|
OneDoFJoint(java.lang.String name,
RigidBody predecessor,
RigidBody successor,
ReferenceFrame beforeJointFrame,
OneDoFJointReferenceFrame afterJointFrame,
FrameVector jointAxis)
|
|
PrismaticJoint(java.lang.String name,
RigidBody predecessor,
ReferenceFrame beforeJointFrame,
FrameVector jointAxis)
|
|
PrismaticJointReferenceFrame(java.lang.String frameName,
ReferenceFrame parentFrame,
FrameVector axis)
|
|
RevoluteJoint(java.lang.String name,
RigidBody predecessor,
ReferenceFrame beforeJointFrame,
FrameVector jointAxis)
|
|
RevoluteJointReferenceFrame(java.lang.String frameName,
ReferenceFrame parentFrame,
FrameVector axis)
|
Uses of FrameVector in us.ihmc.utilities.test |
---|
Methods in us.ihmc.utilities.test with parameters of type FrameVector | |
---|---|
static void |
JUnitTools.assertFrameVectorEquals(FrameVector expected,
FrameVector actual,
double delta)
|
|
||||||||||
PREV NEXT | FRAMES NO FRAMES |