Go to the documentation of this file.
74 using ::std::numeric_limits;
76 double norm_w = w.norm();
78 if(norm_w < numeric_limits<double>::epsilon() ) {
82 double th = norm_w * dt;
87 out_p = rot * p0 + (Matrix33::Identity() - rot) * w_n.cross(vo_n) + w_n * w_n.transpose() * vo_n * th;
88 out_R.noalias() = rot * R0;
95 body->clearSensorValues();
108 for(
int i=0;
i <
n; ++
i){
111 sensor->
w = sensor->
localR.transpose() * link->R.transpose() * link->w;
115 for(
int i=0;
i <
n; ++
i){
127 Vector3 o_Vgsens(link->
R * (link->
R.transpose() * link->
w).cross(sensor->
localPos) + link->
v);
131 for(
int i=0;
i < 3; ++
i){
132 x[
i](0) = o_Vgsens(
i);
137 for(
int i=0;
i < 3; ++
i){
138 x[
i] =
A * x[
i] + o_Vgsens(
i) *
B;
142 Vector3 o_Agsens(x[0](1), x[1](1), x[2](1));
145 sensor->
dv.noalias() = sensor->
localR.transpose() * link->
R.transpose() * o_Agsens;
153 for(
int i=0;
i <
n; ++
i){
161 static const double n_input = 100.0;
162 static const double n_output = 0.001;
168 Ac << -sqrt(2*n_input/n_output), 1.0,
169 -n_input/n_output, 0.0;
171 vector2 Bc(sqrt(2*n_input/n_output), n_input/n_output);
173 A = matrix22::Identity();
180 double factorial[14];
183 for(
int i=2;
i <= 13; ++
i){
185 factorial[
i] = factorial[
i-1] * r;
188 for(
int i=1;
i <= 12;
i++){
189 An2.noalias() = Ac * An;
191 A += (1.0 / factorial[
i]) * An;
193 Bn2.noalias() = Ac * Bn;
195 B += (1.0 / factorial[
i+1]) * Bn;
virtual void initializeSensors()
Matrix33 rodrigues(const Vector3 &axis, double q)
void updateAccelSensor(AccelSensor *sensor)
static void SE3exp(Vector3 &out_p, Matrix33 &out_R, const Vector3 &p0, const Matrix33 &R0, const Vector3 &w, const Vector3 &vo, double dt)
update position/orientation using spatial velocity
void initializeAccelSensors()
EIGEN_MAKE_ALIGNED_OPERATOR_NEW ForwardDynamics(BodyPtr body)
virtual void updateSensorsFinal()
Vector3 w
angular velocity, omega
enum hrp::ForwardDynamics::@2 integrationMode
virtual ~ForwardDynamics()
boost::shared_ptr< Body > BodyPtr
void setGravityAcceleration(const Vector3 &g)
void setRungeKuttaMethod()
void setTimeStep(double timeStep)
void enableSensors(bool on)
openhrp3
Author(s): AIST, General Robotix Inc., Nakamura Lab of Dept. of Mechano Informatics at University of Tokyo
autogenerated on Wed Sep 7 2022 02:51:02