Go to the documentation of this file.
    4 import pinocchio 
as pin
 
    5 from test_case 
import PinocchioTestCase
 
   10         self.
model = pin.buildSampleModelHumanoidRandom(
True, 
True)
 
   12             self.
model.getJointId(
"rarm2_joint")
 
   13             if self.
model.existJointName(
"rarm2_joint")
 
   14             else (self.
model.njoints - 1)
 
   20         v = np.random.rand(self.
model.nv)
 
   21         a = np.random.rand(self.
model.nv)
 
   33             self.
model, data, self.
joint_idx, pin.ReferenceFrame.LOCAL_WORLD_ALIGNED
 
   50             self.
model, data, self.
joint_idx, pin.ReferenceFrame.LOCAL_WORLD_ALIGNED
 
   64             self.
model, data, self.
joint_idx, pin.ReferenceFrame.LOCAL_WORLD_ALIGNED
 
   68 if __name__ == 
"__main__":
 
  
static void act(const Eigen::MatrixBase< Mat > &iV, const ForceDense< ForceDerived > &f, Eigen::MatrixBase< MatRet > const &jF)
Action of a motion set on a force object. The input motion set is represented by a 6xN matrix whose e...
void randomConfiguration(const LieGroupGenericTpl< LieGroupCollection > &lg, const Eigen::MatrixBase< ConfigL_t > &q0, const Eigen::MatrixBase< ConfigR_t > &q1, const Eigen::MatrixBase< ConfigOut_t > &qout)
void forwardKinematics(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const Eigen::MatrixBase< TangentVectorType1 > &v, const Eigen::MatrixBase< TangentVectorType2 > &a)
Update the joint placements, spatial velocities and spatial accelerations according to the current jo...
ConstraintDataTpl< Scalar, Options, ConstraintCollectionTpl > createData(const ConstraintModelTpl< Scalar, Options, ConstraintCollectionTpl > &cmodel)
def assertApprox(self, a, b, eps=1e-6)
MotionTpl< Scalar, Options > getVelocity(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const JointIndex jointId, const ReferenceFrame rf=LOCAL)
Returns the spatial velocity of the joint expressed in the desired reference frame....
MotionTpl< Scalar, Options > getClassicalAcceleration(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const JointIndex jointId, const ReferenceFrame rf=LOCAL)
Returns the "classical" acceleration of the joint expressed in the desired reference frame....
MotionTpl< Scalar, Options > getAcceleration(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const JointIndex jointId, const ReferenceFrame rf=LOCAL)
Returns the spatial acceleration of the joint expressed in the desired reference frame....
pinocchio
Author(s): 
autogenerated on Wed May 28 2025 02:41:14