Codota Logo
Quaternion.set
Code IndexAdd Codota to your IDE (free)

How to use
set
method
in
us.ihmc.euclid.tuple4D.Quaternion

Best Java code snippets using us.ihmc.euclid.tuple4D.Quaternion.set (Showing top 20 results out of 315)

  • Add the Codota plugin to your IDE and get smart completions
private void myMethod () {
Connection c =
  • Codota IconDataSource dataSource;dataSource.getConnection()
  • Codota IconString url;DriverManager.getConnection(url)
  • Codota IconIdentityDatabaseUtil.getDBConnection()
  • Smart code suggestions by Codota
}
origin: us.ihmc/ihmc-avatar-interfaces

  public void packOrientation(Quaternion orientation)
  {
   // FIXME used to be that before switching to EuclidCore
//      orientation.setW((this.orientation[0]));
//      orientation.setW((this.orientation[1]));
//      orientation.setW((this.orientation[2]));
//      orientation.setW((this.orientation[3]));
   orientation.set(this.orientation);
  }

origin: us.ihmc/ros2-common-interfaces

@Override
protected void copy(Quaternion src, Quaternion dest)
{
 dest.set(src);
}
origin: us.ihmc/ihmc-robotics-toolkit

@Override
public void update()
{
 if (unfilteredQuaternion == null)
 {
   throw new NullPointerException("AlphaFilteredYoFrameQuaternion must be constructed with a non null "
      + "quaternion variable to call update(), otherwise use update(Quat4d)");
 }
 qMeasured.set(unfilteredQuaternion);
 update(qMeasured);
}
origin: us.ihmc/ihmc-robotics-toolkit

@Override
public void set(SO3Waypoint other)
{
 orientation.set(other.orientation);
 angularVelocity.set(other.angularVelocity);
}
origin: us.ihmc/ihmc-robotics-toolkit

public void queueAxisAngle(AxisAngle axisAngle)
{
 tempQuaternion.set(axisAngle);
 queueQuaternion(tempQuaternion);
}
origin: us.ihmc/ihmc-robotics-toolkit

public void queueMatrix(RotationMatrix rotationMatrix)
{
 tempQuaternion.set(rotationMatrix);
 queueQuaternion(tempQuaternion);
}
origin: us.ihmc/ihmc-robotics-toolkit

public static Quaternion nextQuaternion(Random random, double minMaxAngleRange)
{
 AxisAngle orientation = nextAxisAngle(random, minMaxAngleRange);
 Quaternion quat = new Quaternion();
 quat.set(orientation);
 return quat;
}
origin: us.ihmc/ihmc-avatar-interfaces-test

private PelvisOrientationTrajectoryMessage createPelvisOrientationTrajectoryMessage(Vector3D rotationAxis, double rotationAngle)
{
 AxisAngle desiredPelvisAxisAngle = new AxisAngle(rotationAxis, rotationAngle);
 Quaternion desiredPelvisQuat = new Quaternion();
 desiredPelvisQuat.set(desiredPelvisAxisAngle);
 PelvisOrientationTrajectoryMessage pelvisOrientationTrajectoryMessage = HumanoidMessageTools.createPelvisOrientationTrajectoryMessage(3.0,
                                                                    desiredPelvisQuat);
 return pelvisOrientationTrajectoryMessage;
}
origin: us.ihmc/ihmc-humanoid-robotics

public static VehiclePosePacket createVehiclePosePacket(Point3D position, Quaternion orientation)
{
 VehiclePosePacket message = new VehiclePosePacket();
 message.getPosition().set(position);
 message.getOrientation().set(orientation);
 return message;
}
origin: us.ihmc/ihmc-quadruped-robotics-test

public double getBodyEstimateYaw()
{
 bodyOrientation.set(bodyCurrentOrientationQx.getDoubleValue(), bodyCurrentOrientationQy.getDoubleValue(), bodyCurrentOrientationQz.getDoubleValue(),
           bodyCurrentOrientationQs.getDoubleValue());
 return bodyOrientation.getYaw();
}
origin: us.ihmc/ihmc-humanoid-robotics

public static WallPosePacket createWallPosePacket(double cuttingRadius, Tuple3DReadOnly centerPosition, QuaternionReadOnly centerOrientation)
{
 WallPosePacket message = new WallPosePacket();
 message.setCuttingRadius(cuttingRadius);
 message.getCenterPosition().set(centerPosition);
 message.getCenterOrientation().set(centerOrientation);
 return message;
}
origin: us.ihmc/ihmc-humanoid-robotics

public static WallPosePacket createWallPosePacket(double cuttingRadius, Tuple3DReadOnly centerPosition, RotationMatrixReadOnly rotationMatrix)
{
 WallPosePacket message = new WallPosePacket();
 message.setCuttingRadius(cuttingRadius);
 message.getCenterPosition().set(centerPosition);
 message.getCenterOrientation().set(new Quaternion(rotationMatrix));
 return message;
}
origin: us.ihmc/ihmc-humanoid-behaviors

private void lookDown()
{
  AxisAngle orientationAxisAngle = new AxisAngle(0.0, 1.0, 0.0, Math.PI / 2.0);
  Quaternion headOrientation = new Quaternion();
  headOrientation.set(orientationAxisAngle);
  HeadTrajectoryMessage headTrajectoryMessage = HumanoidMessageTools.createHeadTrajectoryMessage(1.0, headOrientation, ReferenceFrame.getWorldFrame(),
                                                 referenceFrames.getChestFrame());
  headTrajectoryMessage.setDestination(PacketDestination.CONTROLLER.ordinal());
  headTrajectoryPublisher.publish(headTrajectoryMessage);
}
origin: us.ihmc/ihmc-avatar-interfaces-test

private void addFootstep(Point3D stepLocation, Quaternion orient, RobotSide robotSide, FootstepDataListMessage message)
{
 FootstepDataMessage footstepData = new FootstepDataMessage();
 footstepData.getLocation().set(stepLocation);
 footstepData.getOrientation().set(orient);
 footstepData.setRobotSide(robotSide.toByte());
 message.getFootstepDataList().add().set(footstepData);
}
origin: us.ihmc/ihmc-avatar-interfaces-test

private void addFootstep(Point3D stepLocation, Quaternion orient, RobotSide robotSide, FootstepDataListMessage message)
{
 FootstepDataMessage footstepData = new FootstepDataMessage();
 footstepData.getLocation().set(stepLocation);
 footstepData.getOrientation().set(orient);
 footstepData.setRobotSide(robotSide.toByte());
 message.getFootstepDataList().add().set(footstepData);
}
origin: us.ihmc/ihmc-mocap

  public void getPose(RigidBodyTransform pose)
  {
   quaternion.set(qx.getDoubleValue(), qy.getDoubleValue(), qz.getDoubleValue(), qw.getDoubleValue());
   pose.setRotation(quaternion);
   pose.setTranslation(xPos.getDoubleValue(), yPos.getDoubleValue(), zPos.getDoubleValue());
  }
}
origin: us.ihmc/ihmc-humanoid-robotics

public static IMUPacket nextIMUPacket(Random random)
{
 IMUPacket next = new IMUPacket();
 next.getLinearAcceleration().set(EuclidCoreRandomTools.nextVector3D32(random));
 next.getOrientation().set(EuclidCoreRandomTools.nextQuaternion32(random));
 next.getAngularVelocity().set(EuclidCoreRandomTools.nextVector3D32(random));
 return next;
}
origin: us.ihmc/ihmc-humanoid-robotics

public void computeChestTrajectoryMessage()
{
 checkIfDataHasBeenSet();
 ReferenceFrame chestFrame = fullRobotModelToUseForConversion.getChest().getBodyFixedFrame();
 Quaternion desiredQuaternion = new Quaternion();
 FrameQuaternion desiredOrientation = new FrameQuaternion(chestFrame);
 desiredOrientation.changeFrame(worldFrame);
 desiredQuaternion.set(desiredOrientation);
 ReferenceFrame pelvisZUpFrame = referenceFrames.getPelvisZUpFrame();
 ChestTrajectoryMessage chestTrajectoryMessage = HumanoidMessageTools.createChestTrajectoryMessage(trajectoryTime, desiredQuaternion, worldFrame, pelvisZUpFrame);
 output.getChestTrajectoryMessage().set(chestTrajectoryMessage);
}
origin: us.ihmc/ihmc-avatar-interfaces-test

private void addFootstep(Point3D stepLocation, RobotSide robotSide, FootstepDataListMessage message)
{
 FootstepDataMessage footstepData = new FootstepDataMessage();
 footstepData.getLocation().set(stepLocation);
 footstepData.getOrientation().set(new Quaternion(0.0, 0.0, 0.0, 1.0));
 footstepData.setRobotSide(robotSide.toByte());
 message.getFootstepDataList().add().set(footstepData);
}
origin: us.ihmc/ihmc-humanoid-robotics

public static VideoPacket createVideoPacket(VideoSource videoSource, long timeStamp, byte[] data, Point3DReadOnly position, QuaternionReadOnly orientation,
                      IntrinsicParameters intrinsicParameters)
{
 VideoPacket message = new VideoPacket();
 message.setVideoSource(videoSource.toByte());
 message.setTimestamp(timeStamp);
 message.getData().add(data);
 message.getPosition().set(position);
 message.getOrientation().set(orientation);
 message.getIntrinsicParameters().set(toIntrinsicParametersMessage(intrinsicParameters));
 return message;
}
us.ihmc.euclid.tuple4DQuaternionset

Popular methods of Quaternion

  • <init>
  • getS
  • getX
  • getY
  • getZ
  • multiply
  • setYawPitchRoll
  • getYaw
  • applyTransform
  • epsilonEquals
  • transform
  • appendRollRotation
  • transform,
  • appendRollRotation,
  • equals,
  • get,
  • interpolate,
  • multiplyConjugateOther,
  • normalize,
  • setRotationVector,
  • appendPitchRotation

Popular in Java

  • Creating JSON documents from java classes using gson
  • onCreateOptionsMenu (Activity)
  • runOnUiThread (Activity)
  • setRequestProperty (URLConnection)
    Sets the general request property. If a property with the key already exists, overwrite its value wi
  • FileWriter (java.io)
    Convenience class for writing character files. The constructors of this class assume that the defaul
  • BigDecimal (java.math)
    An immutable arbitrary-precision signed decimal.A value is represented by an arbitrary-precision "un
  • TimeUnit (java.util.concurrent)
    A TimeUnit represents time durations at a given unit of granularity and provides utility methods to
  • Stream (java.util.stream)
    A sequence of elements supporting sequential and parallel aggregate operations. The following exampl
  • Filter (javax.servlet)
    A filter is an object that performs filtering tasks on either the request to a resource (a servlet o
  • FileUtils (org.apache.commons.io)
    General file manipulation utilities. Facilities are provided in the following areas: * writing to a
Codota Logo
  • Products

    Search for Java codeSearch for JavaScript codeEnterprise
  • IDE Plugins

    IntelliJ IDEAWebStormAndroid StudioEclipseVisual Studio CodePyCharmSublime TextPhpStormVimAtomGoLandRubyMineEmacsJupyter
  • Company

    About UsContact UsCareers
  • Resources

    FAQBlogCodota Academy Plugin user guide Terms of usePrivacy policyJava Code IndexJavascript Code Index
Get Codota for your IDE now