Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/project-march/projectmarch.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-08-20 |
Dev Status | UNMAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Alexander James Becoy
Authors
MARCH Inverse Kinematics Solver
Overiew
This package is an implementation of the pseudo-inverse Jacobian-based inverse kinematics using task priority control. In principle, it solves the inverse kinematics by converging towards the desired task configurations based on the current joint configuration.
The Inverse Kinematics Solver Node (IK Solver Node) is enacted when it receives desired feet positions from the Gait Planning Node given that the State Estimator Node updates the joint state beforehand. Using Complete Orthogonal Decomposition, it calculates the pseudo-inverse of the Jacobian which is then used to transform the weighted error between the desired and the current workspace positions into the desired joint velocity. This joint velocity is integrated over some timestep to obtain the desired position. The solving of the inverse kinematics is iterated as many times as possible within two states. The iterations is terminated once convergence, max number of iterations, or the maximum timeout are reached. The IK Solver Node then finally publishes the desired joint positions to the Hardware Interface via Joint Trajectory Controller.
The flow of the IK Solver Node integrated with the other relevant modules can be seen in the sequence diagram below.
Keywords: inverse kinematics, task priority control
License
The source is released under GNUGNU General Public License v3.0 and above
Author: Alexander James Becoy
Affiliation: Project MARCH
Maintainers:
- Alexander James Becoy, alexanderjames.becoy@projectmarch.nl
The MARCH State Estimator package has been tested under ROS2 Foxy on Ubuntu 20.04.
Installation
Building from Source
Dependencies
- Robot Operatibg System 2 (ROS2) (middleware for robotics),
- Eigen (linear algebra library)
- Boost (support for linear algebra library)
Building
To build from source, clone the latest version from this repository into MARCH’s ROS2 workspace and compile the package using
cd ~/march/ros2
rosdep install --from-paths . --ignore-src
mba
source install/local_setup.bash
Unit Tests
Run the unit tests with
colcon test --packages-select march_ik_solver && colcon test-result --verbose
or when using the MARCH aliases
mbt march_ik_solver
Usage
You can try out the inverse kinematics solver by launching the simulation.
ros2 launch march_launch march.launch.py
Then press or type the available gait modes in the newly launched Input Device GUI / Terminal.
Config files
- ik_solver.yaml: Contains the parameters for the IKSolver and Tasks. See Nodes > ik_solver_node > Parameters.
Launch files
-
ik_solver.launch.py: Launch the IK Solver Node with the parameters given in the
ik_solver.yaml
.
Nodes
ik_solver_node
TODO: Provide description of this node
Subscribed Topics
-
/state_estimation/state
(march_shared_msgs/StateEstimation) Joint state, filtered IMU, feet poses, and stance leg. -
/ik_solver/buffer/input
(march_shared_msgs/IKSFootPositions) header, and left foot position and right foot position in body reference frame.
Published Topic
-
/joint_trajectory_controller/joint_trajectory
(trajectory_msgs/JointTrajectory)
Client
-
/state_estimation/get_node_position
(march_shared_msgs/srv/GetNodePosition) -
/state_estimation/get_node_jacobian
(march_shared_msgs/srv/GetNodeJacobian)
Parameters
-
state_estimator_time_offset
: Time offset between two states from State Estimator Node in seconds. -
joint_trajectory_controller_period
: Time to arrive at desired joint positions from the current joint positions in seconds. -
convergence_threshold
: Obtained desired joint positions is accepted if the corresponding error norm is below this threshold. -
max_iterations
: Max number of iteration of solving the inverse kinematics. -
integral_dt
: Timestep for integrating the joint velocity to joint position. -
joint
:-
names
: List of names of the joints in this order. Additionally, in order of left to right, and from base to foot. -
limits
:-
positions
: List ofupper
andlower
joint positions limits to the corresponding joint name in degrees. -
velocities
: List ofupper
andlower
joint velocities limits to the corresponding joint name in degrees.
-
-
-
task_names
: List of names of the task in this order. First task has the lowest priority. The list is also used to iterate over the following parameters. -
arbitrary task name
:-
nodes
: List of names of interested nodes to obtain their positions and Jacobians from the Robot Description Node. E.g.left_ankle
andright_ankle
for Motion Task. -
m
: The workspace dimension size in unsigned integer. -
n
: The configuration dimension size in unsigned integer. -
kp
: List of proportional gains corresponding to each element in the workspace vector in double. -
kd
: List of derivative gains corresponding to each element in the workspace vector in double. -
ki
: List of integral gains corresponding to each element in the workspace vector in double. -
damp_coeff
: The damping coefficient to ensure singularity-robustness when calculating the pseudo-inverse in double.
-
Bugs & Feature Requests
Please report bugs and request features using the Issue Tracker.
Credit
Credits to leggedrobotics for providing a template to write the README of a custom ROS package.
Wiki Tutorials
Package Dependencies
System Dependencies
Name |
---|
eigen |