[Documentation] [TitleIndex] [WordIndex

The Kinematic Analyzer module implements different ways of detecting and characterizing different joint types. Different methods are implemented to you can use easily. The Kinematic Analyzer is entirely integrated in a ROS infrastructure, and reads in and publishes data via ROS.

Supported Joint Types

Implemented Joint Detection Methods

In the following we describe which methods are implemented in the kinematic analyzer method. We assume that each method characterizes the relative motion of a pair of feature point clusters.

You can switch between the different implementations by setting the ROS parameter /kinematic_analyzer/joint_estimator.

Transformation based

The most straightforward method is called transformation_based since it examines the rigid transformation of the links between frames. The general procedure is the following:

  1. Each rigid body is represented as a point cloud of 3D features. We estimate the rigid body transformation that explains the motion of each point cloud between the first and the i-th-frame of the interval under study. We call these motion transformations global motion. We use PCL to find these transformations.

  2. For each pair of rigid bodies we define one of them to be the reference body and the other to be the moving body.

  3. For each frame we subtract the global motion of the reference body to the global motion of the moving body. To do this we transform the moving body using the inverse of the global motion of the reference body. Then we estimate the transformation between the resulting moved point cloud and the original point cloud at the first frame.

  4. As result of the previous steps we obtain the set of motions of the moving body without the motion of the reference body, that is, the local motions of the moving body with respect to the reference body (careful, don't mix it with the reference as origin of coordinates, we refer always the transformations to the same origin of coordinates, even the local motions).

Prismatic Joint

The axis of motion of a prismatic joint is completely defined with its orientation.

Orientation

The orientation of the prismatic joint is defined as the vector that goes from the center of the moving point cloud to this same center after being applied the rigid motion transformation of the last frame on it. This integrates the rotation into the translation. The orientation of the axis is filtered by the RE framework. That means, the filter generates a prediction of the orientation of the axis from the believed orientation and the current control signal (general motion). This predicted orientation is then compared with the measured one and the belief is changed according to the difference.

Position

The point of application of the joint is unnecessary. As convention, we select as point of application the middle point between the centers of both point clusters defining the rigid bodies. Since it is not necessary, we don't filter it within the RE framework. It is taken as it is from the last measurement.

Revolute Joint

To define completely the axis of rotation of a revolute joint we need to provide its orientation and position.

Orientation

We can easily extract the orientation of the axis and the angle of a rotation from the quaternion defining the orientation (see http://www.euclideanspace.com/maths/geometry/rotations/conversions/quaternionToAngle/index.htm). But careful, the conversion hat 2 singularities, at 0 and at 180 degrees:

The orientation of the axis of rotation is filtered in the RE framework.

Position

We need to provide one point, that the axis of a rotation passes through, in order to define the axis completely. In the previous implementation this point was estimated as part of the circle fitting procedure. Now, we estimate this point from the definition of the rigid body motion. If we would know the axis of rotation (position and orientation) we could easily generate the transformation matrix (details in http://www.euclideanspace.com/maths/geometry/affine/aroundPoint/index.htm) :

R_00

R_01

R_02

x - x*R_00 -y*R_01 -z*R_02

R_10

R_11

R_12

y - x*R_10 -y*R_11 -z*R_12

R_20

R_21

R_22

z - x*R_20 -y*R_21 -z*R_22

0

0

0

1

We need to extract P=(x,y,z), which is the point that the axis passes through. We obtain this matrix from PCL when registering the point clouds between different frames:

R_00

R_01

R_02

tx

R_10

R_11

R_12

ty

R_20

R_21

R_22

tz

0

0

0

1

And then we obtain a system of linear equations on x, y and z:

which we can reformulate in the classical form A*x = b, were x=P=(x,y,z), b=t=(tx,ty,tz) and A:

1-R_00

-R_01

-R_02

-R_10

1-R_11

-R_12

-R_20

-R_21

1-R_22

Unfortunately, this system is ill/poorly defined and for small angles of rotation the solution we can find is inaccurate. We solve it using the pseudo-inverse based on SVD-decomposition. To estimate the goodness of the solution we provide the value:

This value is closer to zero as the x_estimated is closer to a real solution.

Circle and Cylinder fitting

The method has been devised by Dov Katz and colleagues: Dov Katz's PhD Thesis

It is called feature_based within the framework.

Recursive Estimation

The recursive estimation joint estimator is a meta package... TODO

You will need to select which underlying you use by setting the ROS parameter /kinematic_analyzer/joint_estimator_in_re.

Implementing your own method

There are some steps to be taken to implement your own joint estimation method.

Take a look at the other methods to see what has to be implemented and how in detail.

Package Description

The module provides methods to estimating the joint types between of a set of moving objects. An object is given a set of visual features, namely 3D points.

In the package there exists only node named kinematic_analyzer. In the following we explain which parameters can be set, and how to handle input and output data.

Information Flow

Parameters

/number_features

/video_sensor_type

/3d_from_sensor

/min_cluster_size

/min_motion

/kinematic_analyzer/joint_estimator

/kinematic_analyzer/joint_estimator_in_re

/kinematic_analyzer/interval_selection

/kinematic_analyzer/interval_selection_overlap

/kinematic_analyzer/trigger_by_segmentation

ROS Subscribers

/iap/feature_set_3d

/iap/estimated_feature_set_3d

/iap/segmentation

/iap/num_features

/iap/reset

/iap/external_trigger

ROS Publishers

/iap/kinematic_structure

ROS Services

None.

ROS Messages

None. See iap_common.


2023-10-28 12:44