Next Article in Journal
The Influence of Visible Cables and Story Content on Perceived Autonomy in Social Human–Robot Interaction
Previous Article in Journal
What Is Next in Computer-Assisted Spine Surgery? Advances in Image-Guided Robotics and Extended Reality
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Static Modeling of a Class of Stiffness-Adjustable Snake-like Robots with Gravity Compensation

School of Mechanical & Manufacturing Engineering, The University of New South Wales, Sydney, NSW 2052, Australia
*
Author to whom correspondence should be addressed.
These authors contributed equally to this work.
Robotics 2023, 12(1), 2; https://doi.org/10.3390/robotics12010002
Submission received: 27 October 2022 / Revised: 2 December 2022 / Accepted: 16 December 2022 / Published: 22 December 2022
(This article belongs to the Section Medical Robotics and Service Robotics)

Abstract

:
Stiffness-adjustable snake-like robots have been proposed for various applications, including minimally invasive surgery. Based on a variable neutral-line mechanism, previous works proposed a class of snake-like robots that can adjust their stiffness by changing the driving cables’ tensions. A constant curvature hypothesis was used to formulate such robots’ kinematics and was further verified by our previous work via rigorous force analysis and ADAMS simulations. However, all these models and analyses have ignored the effect of the robot links’ gravity, resulting in significant errors in real systems. In this paper, a static model considering gravity compensation is proposed for the stiffness-adjustable snake-like robots. The proposed model adopts a nonlinear Gauss–Seidel iteration scheme and consists of two parts: gravity update and pose estimation. In each iteration, the former updates the payload of each link caused by gravity, and the latter estimates the pose of the robot by refreshing the angle and position values. This iteration stops when the change in the tip position is less than a pre-set error ϵ . During the above process, the only dependent information is each cable’s tension. Simulations and experiments are carried out to verify the effectiveness of the proposed model. The impact of gravity is found to increase with growing material densities in the simulations. The experimental results further indicate that compared with a model without gravity compensation, our model reduces the tip estimation error by 91.5% on average.

1. Introduction

Inspired by nature, snake-like robots [1,2] have been invented to provide higher flexibility compared with traditional rigid manipulators. Usually designed with high degrees of freedom in small sizes, snake-like robots are highly suitable for tasks requiring traversing through narrow and tortuous passages or dexterous manipulation in confined environments [3,4]. As such, they have been proposed for various applications, including industrial inspection [5], search and rescue [6], and robotic surgery [7,8,9,10].
The capability of adjusting the robot’s stiffness has been a desired property in many applications. For example, the robot may need to present low stiffness during compliant and safe deployment and high stiffness for high-force and precise operations once reaching target sites in minimally invasive surgery [11]. Different designs have been studied to address this need, such as using compliant joints [12,13], shape memory alloy [14], and phase change material alloy [15]. Among them, a cable-driven, curved-joint-based manipulator was proposed that is simple in design and fabrication [16]. The robot achieves adjustable stiffness by changing the driving cable’s tensions, which results in a varying neutral line between adjacent links during bending. A system using this design was developed for Single-Port Access Surgery, in which the main structure housing multiple instruments could adjust its stiffness during surgery [17]. For the same purpose, [18,19] designed a torsionally steerable flexible robot with an analysis of its dexterity and motion optimization. A similar mechanism has also been used in the SnakeRaven system for robotic arthroscopy based on patient-specific design [20,21].
Static modeling relating the robot’s shape and tip position to its cable forces is important for predicting the robot’s behaviors, as the stiffness is adjusted by changing the cables’ tensions. In our previous study [22], a static model for the stiffness-adjustable robot ignoring the robot’s gravity was developed, which can accurately estimate the robot’s bending angles and tip position given the cable tensions. The model also verified, through a rigorous force analysis, the constant curvature hypothesis commonly adopted in the kinematic modeling of such snake-like robots [16,23].
The hypothesis is valid when the robot is tiny in size and made of low-density material. However, when the robot’s size is considerably large (such as the main structure design in [16]) or the robot uses high-density material (such as metal), the effects of gravity may not be ignored. As shown in Figure 1, the robot’s real shape affected by gravity may deviate significantly from the one estimated from a constant curvature hypothesis. Therefore, it is necessary to investigate the effect of gravity in the static modeling of the stiffness-adjustable snake-like robot.

1.1. Related Works

1.1.1. Non-Static Modeling of Stiffness-Adjustable Rolling-Joint Snake-Like Robots

Early works on stiffness-adjustable rolling-joint snake-like robots have focused on the design and kinematic modeling of the robots. Yong-Jae Kim et al. [16] first introduced the rolling-joint snake-like robot capable of controlling stiffness by varying cable tensions. The approximate correspondence between the stiffness and tensions is obtained by the analysis of geometry and energy relying on the simplified geometric assumptions. In the same year, Jongwon Lee et al. [24] designed a teleoperation platform for this kind of robot and conducted a tension propagation analysis. In 2014, Jusuk Lee et al. [17] continued to perform kinematic modeling on the robot to estimate the workspace and control its tip pose through inverse kinematics.
Although the rough tip position and orientation of the robot could be achieved in these studies under the constant bending-angle assumption, the accurate mapping between the robot’s shape and the cable tensions still needs to be investigated.

1.1.2. Static Modeling of Stiffness-Adjustable Rolling-Joint Snake-Like Robots

In 2020, Jeongryul Kim et al. [25] first performed static modeling on a one-degree-of-freedom plastic robot to estimate its stiffness. Here, blocks were added between adjacent links to improve the performance of the stiffness for the rolling-joint snake-like robot described in Section 1.1.1. The key point of the algorithm proposed in the paper is to solve all the static equilibrium equations by optimization, i.e., by minimizing the sum of the absolute value of moments. In the same year, Jeongryul Kim et al. [26] extended the algorithm to the steel robot proposed by [16] to derive more accurate values of the shape. Independently from these two works, our group also achieved the shape of a similar robot with generalized orientation angles by conducting static analysis in our previous study [22]. The bending angle of each link is calculated quickly and iteratively from the tip to the bottom. However, the existence of friction and gravity has still been neglected in these studies.
In 2022, to enhance the accuracy of shape estimation, Jeongryul Kim et al. [27] continued to apply their previous algorithm to the modified steel snake-like robot by including the Coulomb friction model. Although the materials of the prototype vary from plastic to stainless steel, and the diameters of each link vary from 4.5 to 12 mm in the studies in this section, the effect of gravity has still not been discussed.

1.1.3. Gravity Compensation in Static Modeling

Models without gravity compensation may yield significant estimation error [28], especially when the robot is made of high-density material or is long or large in size. Various studies have assessed the effect of gravity in the field of continuum robots. For example, in 2009, Bryan A. Jones et al. [29] conducted a static analysis based on the Cosserat rod theory to evaluate the shape of the continuum robot. Gravity was included in the modeling and proved to be critical to the accuracy of the experiment by the comparison of accuracy between the proposed model with the analytical one without gravity. In 2016, Han Yuan, et al. [30] also performed static modeling incorporating gravity based on the Newton–Euler method on continuum robots. The accuracy of the model was validated by the simulations in ANSYS.
Despite these research efforts, gravity compensation is still absent in previous studies on the modeling of this kind of rolling-joint snake-like robot [16,22,25,26,27,31].

1.2. Contributions

In this paper, a static model with gravity compensation is established for the stiffness-adjustable snake-like robot. Given the forces of the driving cables, the proposed model can accurately estimate the overall shape of the robot and its tip position. This is achieved by conducting a static analysis of the force interaction between adjacent links and the driving cables, followed by developing an algorithm iteratively updating the effect of each link’s gravity and evaluating the bending angles between adjacent links. A group of simulations is carried out in the MSC ADAMS (Automated Dynamic Analysis of Mechanical Systems) to validate the model with various materials and robot configurations. The results show that the hypothesis of constant curvature taken in previous studies is violated when considering gravity’s effect. In particular, the disparity in the bending angles becomes dominant when the robot’s material density increases. The results are further confirmed in experiments with a real snake-like robot under ground- and ceiling-mounted setups. In all the simulations and experiments, the developed algorithm can precisely estimate the robot’s shape and tip position compared to the ground truth generated by ADAMS (simulation) and a camera/optical tracking system (experiment).
The contributions of this work lie in two parts: (1) We propose a static model with gravity compensation that can accurately predict the shape and tip position of a stiffness-adjustable robot given the actuating cable forces. The model sets a foundation for further development in stiffness control, external force estimation, and compliant motion control. (2) Using the developed static model, we reveal the impact of gravity on the constant curve hypothesis widely adopted in the modeling of such robots. It is found that the effect of gravity cannot be ignored when the robot’s size is considerably large or dense materials are used. Incorporating gravity compensation will significantly improve the accuracy of shape estimation in such cases.

2. Modeling

The snake-like robot studied in this paper is illustrated in Figure 2a. Before we study the relationship between the cable forces and the shape of the robot with gravity, each bending angle between adjacent links will be evaluated by a detailed analysis of the static model on a single link in this section.

2.1. Static Model of One Link

This robot is composed of n links with n 1 joints. They are connected in a staggered manner with four driving cables. To simplify the calculations, the robot is assumed to be stationary, rigid, and homogeneous without sliding motion between adjoining links. The elasticity, weight, friction, and backlash related to the cables are also neglected. In this paper, the length of each link is set as L, and the radii of both contact surfaces are R. The orientation is α , where α π 2 , π 2 . The bending angle of joint θ between two adjacent links are shown in Figure 2b. Each link has a top and a bottom cylindrical contact surface, as shown in Figure 2c. The index of each link is numbered from the base to the tip with i { 1 , 2 , , n } , which is similar to that of each joint.

2.1.1. Coordinate System Definition

As shown in Figure 2a, there are two kinds of coordinate systems used in the paper: The local coordinate system (LCS) and the world coordinate system (WCS). In this section, the LCS (frame { i } ) is adopted to estimate the bending angle θ i 1 between link- ( i 1 ) and link-i. The origin is located on the mass center of the link. The z-axis is co-linear with the center line of the link body and toward the base, whereas its y-axis is parallel to the center line of its curved contact surface that is closer to the base. The WCS (frame { w } ) is used in the next section to determine the tip position of the robot. Its origin is fixed in the center of the base of the robot. Its z-axis is parallel with that of the LCS { 1 } but toward the body of the robot. Its y-axis is also parallel with that of the LCS { 1 } .

2.1.2. Cable Tensions and Contact Forces

The variables in the LCS on link-i defined above are shown in Figure 2a. T i , j is the value of the tension applied on cable-j of link-i. φ i , j is the phase angle of cable-j around the center line in link-i, which determines the locations of the cables. The tension applied to the bottom surface T b i , j and its displacement vector l b i , j in the Euclidean space R 3 are:
T b i , j θ i = T i , j sin θ i 2 cos α i , T i , j sin θ i 2 sin α i , T i , j cos θ i 2 ,
l b i , j = r cos φ i , j , r sin φ i , j , L 2 + R R 2 r cos φ i , j + α i 2 .
The tension applied to the top surface T t i , j and its displacement vector l t i , j are:
T t i , j θ i 1 = T i , j sin θ i 1 2 , 0 , T i , j cos θ i 1 2 ,
l t i , j = r cos φ i , j , r sin φ i , j , L 2 R + R 2 r cos φ i , j 2 .
The contact force applied to the bottom surface F c b i , its displacement vector l c b i , and corresponding torque M c b i are:
F c b i θ i , θ i + 1 , , θ n 1 = F b x , i , F b y , i , F b z , i ,
l c b i θ i = R sin θ i 2 cos α i , R sin θ i 2 sin α i , L 2 + R R cos θ i 2 ,
M c b i θ i , θ i + 1 , , θ n 1 = M b x , i , M b y , i , M b z , i .
The contact force applied to the top surface F c t i , its displacement vector l c t i , and corresponding torque M c t i are:
F c t i θ i 1 , θ i , , θ n 1 = F t x , i , F t y , i , F t z , i ,
l c t i θ i 1 = R sin θ i 1 2 , 0 , L 2 R + R cos θ i 1 2 ,
M c t i θ i 1 , θ i , , θ n 1 = M t x , i , M t y , i , M t z , i .
The gravity vector F g i in the LCS { i } and its torque M g i applied on the mass center of link-i are:
F g i θ 1 , θ 2 , , θ i 1 G i = G x , i , G y , i , G z , i ,
M g i θ 1 , θ 2 , , θ i 1 = 0 .

2.1.3. Constraint Equations

Since the robot is static, it should satisfy the constraints of static equilibrium. The equilibrium equations of link-i are:
F i = j = 1 4 T b i , j + T t i , j + F c b i + F c t i + F g i = 0 ,
M i = j = 1 4 l b i , j × T b i , j + l t i , j × T t i , j + l c b i × F c b i + l c t i × F c t i + M c b i + M c t i + M g i = 0 .
For the distal link, we have T b n , j = 0 , F c b n = 0 , and M c b n = 0 , since its bottom in the LCS { n } is free.

3. Shape Estimation

To explore the relationship between the tension and the shape of the robot considering gravity, an iterative method is developed in this paper. The proposed method consists of two parts: gravity update and pose estimation. This section introduces these two components followed by the tip position calculation and the integral algorithm.

3.1. Update of Gravity Vectors

The gravity of link-i in the LCS { i } should be obtained before performing the static analysis on link-i. Its coordinate G w i in the WCS is already known at the beginning of each iteration according to the installation form. Assuming that the mass of each link analyzed is identical (except for the base link, which is not included in the calculation), the gravity of link-i in the WCS is the same for i = 2 , 3 , , n . Let G i ( u ) be the gravity of link-i in the LCS { u } , where u = 1 , 2 , , i . As shown Algorithm 1, to achieve G i ( i ) , its coordinate should be first transformed from WCS { w } to LCS { 1 } , i.e., G i ( 1 ) = R z π α 1 R y π G w i . Later, it requires iterations to transform the coordinate from LCS { 1 } to LCS { i } . The iteration function of u is:
G i ( u ) = R y θ u 1 R z α u G i ( u 1 ) ,
where R x ( θ ) , R y ( ϕ ) , and R z ( ψ ) are S O ( 3 ) rotation matrices about the x, y, z-axes, respectively.
Algorithm 1: Update of gravity vectors.
Robotics 12 00002 i001

3.2. Evaluation of Bending Angles

After the update of the gravity vectors, a backward iterative process is performed to calculate the bending angles. The calculation starts from the angle between the distal link and its adjacent link. Then it continues to calculate the angles between intermediate links iteratively. The complete evaluation process is presented in Algorithm 2.
Algorithm 2: Evaluation of bending angles.
Robotics 12 00002 i002

3.2.1. Single Bending-Angle Computation

Take the calculation of bending angle θ i 1 as an example. The expressions of forces are derived from Equation (13). As illustrated in Figure 1, we have M t y , i = 0 since the contact force passes through the contact point on the top contact surface in the xz plane, and M g i = 0 since the gravity force passes through the origin (mass center). Thus, θ i 1 can be obtained from the y-axis component of the torque-balance equation; Equation (14):
a sin θ i 1 2 + b cos θ i 1 2 + c = 0 ,
where:
a = R cos θ i 2 j = 1 4 T i , j F b z , i G z , i j = 1 4 T i , j R 2 r cos φ i , j 2 b = r j = 1 4 T i , j cos φ i , j + R s i n θ i 2 cos α i j = 1 4 T i , j + F b x , i + G x , i c = cos θ i 2 R F b x , i r j = 1 4 T i , j cos φ i , j sin θ i 2 cos α i { 2 L 2 R j = 1 4 T i , j + j = 1 4 T i , j R 2 r cos φ i , j + α i 2 + R F b z , i } + 2 L 2 R F b x , i + L 2 R G x , i M b y , i
Equation (16) can be solved analytically or by applying the modified Anderson–Björck–King method [32]. The value of θ i 1 , which is both within the range π 2 , π 2 and close to the previous value is selected to be the answer. The remaining components of the torque acting on the top contact surface are derived from Equation (14).

3.2.2. Transformation of Coordinates between Adjacent Links

During the iterative processes, coordinate transformations are needed before applying the variables achieved in the last step to the current one. We assume that the tensions applied to the cables passing through the base in counter-clockwise order in the WCS are { T 0 , j } j = 1 4 . Then if i is odd, we choose α i = α , { T i , j } j = 1 4 = { T 0 , ( j 1 ) } j = 1 4 (where T 0 , 0 = T 0 , 4 ) and { φ i , j } j = 1 4 = { 0 , α , π , π α } in the LCS. Otherwise, α i = α , { T i , j } j = 1 4 = { T 0 , j } j = 1 4 and { φ i , j } j = 1 4 = { 0 , π + α , π , α } . Moreover, we assume that the variables θ i 1 , F c t i and M c t i are achieved in the last static analysis on link-i, then in the current analysis, we have θ i 1 = θ i 1 and the bottom contact force and moment vectors are:
F c b i 1 = R z ( α i ) R y ( θ i 1 ) F c t i M c b i 1 = R z ( α i ) R y ( θ i 1 ) M c t i .

3.3. Calculation of Tip Position

Since the shape of the robot has been achieved in the previous step, we can easily obtain the tip position, as illustrated in Algorithm 3. Let transformation matrices T l d = T l x , y , z = I 3 × 3 d 0 1 × 3 1 be a pure translation of d , and T r y ( ϕ ) = R y ( ϕ ) 0 3 × 1 0 1 × 3 1 & T r z ( ψ ) = R z ( ψ ) 0 3 × 1 0 1 × 3 1 be pure rotation matrices about the y and z-axes, respectively.
Algorithm 3: Calculation of Tip Position.
Robotics 12 00002 i003
   For the base link, the transformation matrix between LCS { 1 } and WCS { w } is:
T 1 w = T l ( d 1 ) * T r z π + α 1 * T r y π ,
where d 1 is the displacement between their origins. For the following links, the transformation matrix from LCS { i } to LCS { i 1 } ( i = 2 , 3 , , n ) is:
T i i 1 = T r z α i * T r y θ i 1 * T l x 0 , 0 , z 0 ,
where x 0 = 2 m l m 2 + 1 , z 0 = 2 l m 2 + 1 , m = tan θ i 1 2 , l = L 2 R 1 cos θ i 1 2 + m R sin θ i 1 2 .
Hence, the transformation matrix from LCS { i } to WCS { w } is:
T i w = T 1 w T 2 1 T i i 1 ,
and the tip position in the WCS is: P w t i p = T n w P n t i p , where P n t i p is the tip of the distal link in the LCS { n } .

3.4. Complete Calculation Procedures

Equation (16), which is used to calculate bending angles θ i , can be regarded as a part of the system of nonlinear equations:
F = f 1 , f 2 , , f n 1 = 0 .
To solve this nonlinear system, an iterative method is proposed in this paper. The complete calculation process of the method is presented in Algorithm 4, including the sub-processes described in Algorithms 1 and 2. It starts with an initial guess of the vector θ 0 = θ 1 0 , , θ i 0 , , θ n 1 0 calculated in the case without gravity compensation. Then the sequence of bending angle vectors θ i k k = 0 is generated, which will converge to the desired solution.
Algorithm 4: Complete process.
Robotics 12 00002 i004
According to Equations (1)–(12) and (16), the function f i in the LCS on link-i is composed of the cable tensions, contact forces, gravity, and torques. Let k be the number of iterations for Equation (21) and θ * i 1 k + 1 be the solution of f i = 0 derived in the ( k + 1 ) th iteration. The parts of tension forces, contact forces and their torques are related to the angles { θ n 1 k + 1 , θ n 2 k + 1 , , θ i k + 1 , θ * i 1 k + 1 } , while those of gravity and its torque are related to the angles { θ 1 k , θ 2 k , , θ i 2 k , θ * i 1 k + 1 } . Thus, each nonlinear function can be expressed as:
f i θ 1 k , θ 2 k , , θ i 2 k , θ * i 1 k + 1 , θ i k + 1 , , θ n 1 k + 1 = 0 ,
which is the primary step of the nonlinear Gauss–Seidel iteration scheme [33]. To simplify the calculation, the parts of gravity and its torque can also be calculated by { θ 1 k , θ 2 k , , θ i 1 k } . The relaxation parameter ω is also introduced to modify all the bending angles derived from the kth iteration before updating the gravity vectors:
θ i k = θ i k 1 + ω θ * i k θ i k 1 .
Usually, the value of relaxation parameter ω is chosen within 0 , 1 [34]. The iteration ends when the change in tip position is less than a predefined threshold ε , i.e., when w P t i p k + 1 w P t i p k < ε . In all the simulations and experiments in this work, ε has been set to 1 × 10 12 .
During the calculation, the initial values of bending angles and the configuration of the value of relaxation parameter ω both affects the convergence and the computational time of the method. For example, the mean execution time for the ground-mounted steel-material spatial-orientation simulation case in Section 4 with ε = 1 × 10 12 was 0.1164 s for ω = 0.1 and 0.0085 s for ω = 1 when calculated a thousand times in MATLAB R2021b on a laptop with macOS 10.15.7, Intel Core i9 CPU (8-Core, 2.3 GHz), and 16 GB memory. To quickly achieve the specified accuracy [33] in the application, we can choose ω = 1 as the initial configuration for rapid convergence. Each time when the computation of the current step does not converge; the step will continue to iterate under the updated configuration with reduced relaxation parameter value (e.g., ω c u r r e n t = ω p r e v i o u s 2 ) using the angle values calculated in the last step.

4. Simulations and Experiments

Two sets of simulations and two sets of experiments were performed to validate the proposed estimation method. In the simulations, the effect of gravity on the snake-like robot’s shape with different material densities was analyzed for both planar- and spatial-orientation cases under ground- and ceiling-mounted setups. In the experiments, the accuracy of the proposed model was further validated using a real snake-like robot in planar and spatial motions with both mounting configurations.

4.1. Simulations

In the simulations, we used ADAMS to simulate the behaviors of the snake-like robots under different configurations and compared them with the calculated results in MATLAB using the proposed method. The simulations consisted of two groups: planar ( α = 0 with 1 degree of freedom) and spatial ( α = 90 with 2 degrees of freedom) cases, with one example for each group shown in Figure 3. In the literature, different materials have been used to fabricate the snake-like robot, such as steel [35], aluminum [36], and acrylonitrile butadiene styrene (ABS) [37]. To identify the effect of gravity on the robot with various materials, four popular materials for 3D printing have been chosen to parameterize the robot in simulation, and their densities were as follows: ABS (1.05 g/cm 3 ), aluminum (2.68 g/cm 3 ), titanium (4.41 g/cm 3 ), and steel (7.86 g/cm 3 ).
In all the simulations, each robot has six links with the following link parameters: Length L = 12 mm, radii of contact surfaces R = 6 mm, cable distance r = 3.5 mm, and volume V = 0.851 cm 3 . All the simulations started from the initial guess { θ i 0 } = 0 with the gravitational acceleration g = 9.8 m/s 2 .

4.1.1. Planar-Orientation Case

In this group of simulations, the forces applied to each cable were [0, 2.4, 0, 5.1] N in all cases. The simulation process of an example case (steel, ground-mounted) is illustrated in Figure 3a. The results are summarized in Table 1, including the bending angles of each joint and the displacement of the tip in the WCS.
In the ground-mounted cases, the z component of the tip position of simulation and estimation with gravity compensation both decrease as the density of the material increases. The mean position error between the estimation with gravity compensation and simulation P e s t P s i m is 2.08 mm. The estimated positions without gravity compensation were fixed, i.e., ( x , y , z ) = ( 47.04 , 0.00 , 14.85 ) , as different material densities do not affect the model when gravity is not considered. The mean position error between the estimation without gravity compensation and the simulation is 17.16 mm, which is bigger than the compensated one.
In the ceiling-mounted cases, since gravity pulls the links away from the base, the z component of the tip position with gravity compensation enlarges while the density increases. The mean position errors between the estimation and simulation results with and without gravity compensation are 3.52 and 12.36 mm, respectively, showing the superior accuracy of the estimation with gravity compensation.
For both mounting configurations, the bending angles estimated without gravity compensation always kept the fixed value with the mean angle error θ i , e s t θ i , s i m = 4.39 , while they are distinct from each other and change with different materials in the simulation. In comparison, the results with gravity compensation are more accurate, with a mean angle error of 0.48 in the planar cases.

4.1.2. Spatial-Orientation Case

In this group of simulations, the tensions applied to each cable were [3.7, 2.4, 1.8, 5.1] N for all cases. The simulation process of an example case (steel, ground-mounted) is illustrated in Figure 3b. The results of the simulations are shown in Table 2.
The variation trends of angles and positions under various materials estimated with gravity compensation are consistent with those simulated in ADAMS. The mean position errors between the simulation and the estimation results with and without gravity compensation in ground-mounted cases are 3.10 and 6.28 mm, and those in ceiling-mounted cases are 1.57 and 2.15 mm. The mean angle errors between them in both ground-mounted and ceiling-mounted cases are 0.56 and 1.52 . The influence of gravity is less vital when the density is relatively low in spatial orientation cases. However, the position errors of cases with and without gravity compensation under the highest density (steel) are 3.98 and 10.89 mm for the ground-mounted case and 1.28 and 3.69 mm for the ceiling-mounted case. Thus, when the density is relatively high, it is critical to implement gravity compensation.

4.2. Experiments

The proposed method was further validated with experiments on a real snake-like robot, which has 12 links with link length L = 12 mm, radii of contact surfaces R = 20 mm, cable distance r = 7.5 mm, and link mass m = 3.8 g, as shown in Figure 4 and Figure 5. The robot has two degrees of freedom with the orientation α = 90 . Similarly to the simulations, both ground-mounted and ceiling-mounted setups were tested. In both configurations, a spirit level was used to make sure the robot base was horizontal. Different weights were added to the cables to adjust their tension.
All the data were collected at static equilibrium points along the paths. To reduce the impact of friction, the tensions started in larger values before it came to the predefined ones so that the robot could keep moving around before settling down. Tip positions were obtained by a real-time tracking system OptiTrack with 10 cameras, whose mean 3D error for overall re-projection was 0.307 mm. The bending angles of the robot were determined via images ( 6016 × 4016 p i x e l s ) captured by a digital camera Nikon D750. Four optical markers were mounted to the frame of both setups to calibrate the x , y , and z-axes for the WCS. Another optical marker was attached to the tip of the robot to calibrate the origin of the WCS when the robot was held straight and to record its tip position during the experiment.

4.2.1. Planar-Motion Case

The experiments performed in planar motions and WCSs for ground- and ceiling-mounted platforms are illustrated in Figure 4a,b,f,g. As shown in Figure 4c–e,h–j, only the values of θ i ( i = 2 , 4 , , 10 ) have been recorded since θ i = 0 for i = 1 , 3 , , 11 . The payloads deployed in each experiment are shown in Table 3. From Figure 4 and Table 3, the real shape (i.e., bending angles) of the robot in both ground-mounted and ceiling-mounted setups have a similar tendency to the estimated shape with gravity compensation. The result shows that the effect of gravity cannot be ignored here, and the shape varies with the direction of gravity.
As shown in Table 3, the mean errors of total bending angles of each case i = 1 11 θ i , e s t i = 1 11 θ i , e x p for the estimation with gravity compensation are 0.72 under ground-mounted and 1.28 under ceiling-mounted configurations, and those for the cases without gravity compensation are 40.71 and 19.23 . The mean tip position errors of estimation P e s t P e x p with gravity compensation are 1.67 mm under ground-mounted and 2.69 mm under ceiling-mounted configurations, and those without gravity compensation are 67.04 mm and 29.12 mm.

4.2.2. Spatial-Motion Case

The experiments performed in spatial motions and WCSs for ground- and ceiling-mounted platforms are illustrated in Figure 5a–f. Nine tip positions { p 1 , p 2 , , p 9 } under different payloads have been recorded for each installation form. Under ground-mounted configurations, the tip of the robot tended to move outward, which is contrary to the ceiling-mounted configurations. The estimated tip positions are compared with the actual tracked tip position. As shown in Table 4, the mean position errors of the estimation with gravity compensation are 2.29 mm under ground-mounted and 3.14 mm under ceiling-mounted configurations, and those without gravity compensation are 28.35 and 20.78 mm, respectively. From the results, it can be clearly seen that the introduction of gravity compensation has significantly improved the accuracy of the estimation.

5. Discussion and Conclusions

In this paper, we proposed a static model with gravity compensation to estimate the bending shape of the snake-like robot according to the tension of each driving cable and the mass of each link. The model employed an iterative algorithm with the effect of each link’s gravity and the bending angles constantly updated until convergence. The model works for a general installation configuration and has been verified by two special cases: ground-mounted and ceiling-mounted. Through simulations, it was found that the constant curvature hypothesis widely used in previous studies is violated when gravity is considered. The difference between a model with gravity compensation and one without is increasingly significant when the robot is made of denser materials. The superiority of the gravity compensation model was further verified by experiments on a real snake-like robot. The proposed model reduced the tip estimation error by 91.5% on average compared to a model without gravity compensation.
In the future, the proposed method will be extended to multi-segment snake-like robots with friction and clearance compensation, and the effect of other external forces will be studied as well.

Author Contributions

Conceptualization, J.H. and L.W.; methodology, J.H.; validation, J.H. and T.L.; formal analysis, J.H.; data curation, J.H. and T.L.; writing—original draft preparation, J.H. and T.L.; writing—review and editing, H.Z., M.X.C., J.K. and L.W.; visualization, T.L.; supervision, J.K. and L.W.; project administration, L.W.; funding acquisition, L.W. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the Australian Research Council under Grant DP210100879.

Data Availability Statement

Not applicable.

Acknowledgments

The authors thank Di Shun Huang for his contribution to the ADAMS simulation and Liuchunzi Guo and Yuhao Su for building the platform for the experiments.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Hirose, S.; Yamada, H. Snake-like robots [Tutorial]. IEEE Robot. Autom. Mag. 2009, 16, 88–98. [Google Scholar] [CrossRef]
  2. Walker, I.D. Continuous backbone “continuum” robot manipulators. Isrn Robot. 2013, 2013, 726506. [Google Scholar] [CrossRef] [Green Version]
  3. Liu, J.; Tong, Y.; Liu, J. Review of snake robots in constrained environments. Robot. Auton. Syst. 2021, 141, 103785. [Google Scholar] [CrossRef]
  4. Takahashi, T.; Tadakuma, K.; Watanabe, M.; Takane, E.; Hookabe, N.; Kajiahara, H.; Yamasaki, T.; Konyo, M.; Tadokoro, S. Eversion Robotic Mechanism With Hydraulic Skeletonto Realize Steering Function. IEEE Robot. Autom. Lett. 2021, 6, 5413–5420. [Google Scholar] [CrossRef]
  5. Elsayed, B.A.; Takemori, T.; Tanaka, M.; Matsuno, F. Mobile Manipulation Using a Snake Robot in a Helical Gait. IEEE/ASME Trans. Mechatron. 2022, 27, 2600–2611. [Google Scholar] [CrossRef]
  6. Han, S.; Chon, S.; Kim, J.; Seo, J.; Shin, D.G.; Park, S.; Kim, J.T.; Kim, J.; Jin, M.; Cho, J. Snake Robot Gripper Module for Search and Rescue in Narrow Spaces. IEEE Robot. Autom. Lett. 2022, 7, 1667–1673. [Google Scholar] [CrossRef]
  7. Wu, L.; Song, S.; Wu, K.; Lim, C.M.; Ren, H. Development of a compact continuum tubular robotic system for nasopharyngeal biopsy. Med. Biol. Eng. Comput. 2017, 55, 403–417. [Google Scholar] [CrossRef] [PubMed]
  8. Paul, L.; Chant, T.; Crawford, R.; Roberts, J.; Wu, L. Prototype development of a hand-held steerable tool for hip arthroscopy. In Proceedings of the 2017 IEEE International Conference on Robotics and Biomimetics (ROBIO), Macau, China, 5–8 December 2017; pp. 989–995. [Google Scholar]
  9. Da Veiga, T.; Chandler, J.H.; Lloyd, P.; Pittiglio, G.; Wilkinson, N.J.; Hoshiar, A.K.; Harris, R.A.; Valdastri, P. Challenges of continuum robots in clinical context: A review. Prog. Biomed. Eng. 2020, 2, 032003. [Google Scholar] [CrossRef]
  10. Burgner-Kahrs, J.; Rucker, D.C.; Choset, H. Continuum robots for medical applications: A survey. IEEE Trans. Robot. 2015, 31, 1261–1280. [Google Scholar] [CrossRef]
  11. Loeve, A.; Breedveld, P.; Dankelman, J. Scopes too flexible…and too stiff. IEEE Pulse 2010, 1, 26–41. [Google Scholar] [CrossRef]
  12. Dong, X.; Raffles, M.; Guzman, S.C.; Axinte, D.; Kell, J. Design and analysis of a family of snake arm robots connected by compliant joints. Mech. Mach. Theory 2014, 77, 73–91. [Google Scholar] [CrossRef]
  13. Lin, B.; Wang, J.; Song, S.; Li, B.; Meng, M.Q.H. A Modular Lockable Mechanism for Tendon-Driven Robots: Design, Modeling and Characterization. IEEE Robot. Autom. Lett. 2022, 7, 2023–2030. [Google Scholar] [CrossRef]
  14. Zhong, Y.; Du, R.; Wu, L.; Yu, H. A novel articulated soft robot capable of variable stiffness through bistable structure. In Proceedings of the 2020 IEEE International Conference on Robotics and Automation (ICRA), Paris, France, 31 May–31 August 2020; pp. 2939–2945. [Google Scholar]
  15. Wang, J.; Wang, S.; Li, J.; Ren, X.; Briggs, R.M. Development of a novel robotic platform with controllable stiffness manipulation arms for laparoendoscopic single-site surgery (LESS). Int. J. Med. Robot. Comput. Assist. Surg. 2018, 14, e1838. [Google Scholar] [CrossRef] [PubMed]
  16. Kim, Y.J.; Cheng, S.; Kim, S.; Iagnemma, K. A Stiffness-Adjustable Hyperredundant Manipulator Using a Variable Neutral-Line Mechanism for Minimally Invasive Surgery. Robot. IEEE Trans. 2014, 30, 382–395. [Google Scholar] [CrossRef] [Green Version]
  17. Lee, J.; Kim, J.; Lee, K.K.; Hyung, S.; Kim, Y.J.; Kwon, W.; Roh, K.; Choi, J.Y. Modeling and control of robotic surgical platform for single-port access surgery. In Proceedings of the 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 3489–3495. [Google Scholar]
  18. Kong, Y.; Song, S.; Zhang, N.; Wang, J.; Li, B. Design and Kinematic Modeling of In-Situ Torsionally-Steerable Flexible Surgical Robots. IEEE Robot. Autom. Lett. 2022, 7, 1864–1871. [Google Scholar] [CrossRef]
  19. Kong, Y.; Wang, J.; Zhang, N.; Song, S.; Li, B. Dexterity Analysis and Motion Optimization of In-Situ Torsionally-Steerable Flexible Surgical Robots. IEEE Robot. Autom. Lett. 2022, 7, 8347–8354. [Google Scholar] [CrossRef]
  20. Razjigaev, A.; Pandey, A.K.; Howard, D.; Roberts, J.; Wu, L. End-to-End Design of Bespoke, Dexterous Snake-Like Surgical Robots: A Case Study With the RAVEN II. IEEE Trans. Robot. 2022, 38, 2827–2840. [Google Scholar] [CrossRef]
  21. Razjigaev, A.; Pandey, A.K.; Howard, D.; Roberts, J.; Wu, L. SnakeRaven: Teleoperation of a 3D Printed Snake-like Manipulator Integrated to the RAVEN II Surgical Robot. In Proceedings of the 2021 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Prague, Czech Republic, 27 September–1 October 2021; pp. 5282–5288. [Google Scholar]
  22. Huang, D.S.; Hu, J.; Guo, L.; Sun, Y.; Wu, L. A Static Model for a Stiffness-Adjustable Snake-Like Robot. In Proceedings of the 2021 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Prague, Czech Republic, 27 September–1 October 2021; pp. 2956–2961. [Google Scholar] [CrossRef]
  23. Webster, R.J., III; Jones, B.A. Design and Kinematic Modeling of Constant Curvature Continuum Robots: A Review. Int. J. Robot. Res. 2010, 29, 1661–1683. [Google Scholar] [CrossRef]
  24. Lee, J.; Kim, Y.J.; Roh, S.g.; Kim, J.; Lee, Y.; Kim, J.; Choi, B.; Roh, K. Tension propagation analysis of novel robotized surgical platform for transumbilical single-port access surgery. In Proceedings of the 2013 IEEE/RSJ International Conference on Intelligent Robots and Systems, Tokyo, Japan, 3–7 November 2013; pp. 3083–3089. [Google Scholar] [CrossRef]
  25. Kim, J.; Kwon, S.i.; Kim, K. Novel block mechanism for rolling joints in minimally invasive surgery. Mech. Mach. Theory 2020, 147, 103774. [Google Scholar] [CrossRef]
  26. Kim, J.; Moon, Y.; Kwon, S.i.; Kim, K. Accurate estimation of the position and shape of the rolling joint in hyper-redundant manipulators. In Proceedings of the 2020 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 24 October 2020–24 January 2021; pp. 3055–3060. [Google Scholar] [CrossRef]
  27. Kim, J.; Kwon, S.I.; Moon, Y.; Kim, K. Cable-Movable Rolling Joint to Expand Workspace Under High External Load in a Hyper-Redundant Manipulator. IEEE/ASME Trans. Mechatron. 2022, 27, 501–512. [Google Scholar] [CrossRef]
  28. Chen, Y.; Zhang, S.; Zeng, L.; Zhu, X.; Xu, K. Model-Based Estimation of the Gravity-Loaded Shape and Scene Depth for a Slim 3-Actuator Continuum Robot with Monocular Visual Feedback. In Proceedings of the 2019 International Conference on Robotics and Automation (ICRA), Montreal, QC, Canada, 20–24 May 2019; pp. 4416–4421. [Google Scholar] [CrossRef]
  29. Jones, B.A.; Gray, R.L.; Turlapati, K. Three dimensional statics for continuum robotics. In Proceedings of the 2009 IEEE/RSJ International Conference on Intelligent Robots and Systems, St. Louis, MO, USA, 11–15 October 2009; pp. 2659–2664. [Google Scholar] [CrossRef]
  30. Yuan, H.; Li, Z.; Wang, H.; Song, C. Static modeling and analysis of continuum surgical robots. In Proceedings of the 2016 IEEE International Conference on Robotics and Biomimetics (ROBIO), Qingdao, China, 3–7 December 2016; pp. 265–270. [Google Scholar] [CrossRef]
  31. Kim, K.; Woo, H.; Suh, J. Design and Evaluation of a Continuum Robot with Discreted link joints for Cardiovascular Interventions. In Proceedings of the 2018 7th IEEE International Conference on Biomedical Robotics and Biomechatronics (Biorob), Enschede, The Netherlands, 26–29 August 2018; pp. 627–633. [Google Scholar] [CrossRef]
  32. Kröger, T. On-Line Trajectory Generation in Robotic Systems: Basic Concepts for Instantaneous Reactions to Unforeseen (Sensor) Events; Springer: Berlin/Heidelberg, Germany, 2010; Volume 58. [Google Scholar]
  33. Vrahatis, M.; Magoulas, G.; Plagianakos, V. From linear to nonlinear iterative methods. Appl. Numer. Math. 2003, 45, 59–77. [Google Scholar] [CrossRef]
  34. Moré, J.J. Nonlinear generalizations of matrix diagonal dominance with application to Gauss–Seidel iterations. SIAM J. Numer. Anal. 1972, 9, 357–378. [Google Scholar] [CrossRef] [Green Version]
  35. Hong, W.; Schmitz, A.; Bai, W.; Berthet-Rayne, P.; Xie, L.; Yang, G.Z. Design and Compensation Control of a Flexible Instrument for Endoscopic Surgery. In Proceedings of the 2020 IEEE International Conference on Robotics and Automation (ICRA), Paris, France, 31 May–31 August 2020; pp. 1860–1866. [Google Scholar] [CrossRef]
  36. Jiang, S.; Chen, B.; Qi, F.; Cao, Y.; Ju, F.; Bai, D.; Wang, Y. A variable-stiffness continuum manipulators by an SMA-based sheath in minimally invasive surgery. Int. J. Med. Robot. Comput. Assist. Surg. 2020, 16, e2081. [Google Scholar] [CrossRef] [PubMed]
  37. Yang, Y.; Chen, Y.; Li, Y.; Chen, M.Z. 3D printing of variable stiffness hyper-redundant robotic arm. In Proceedings of the 2016 IEEE International Conference on Robotics and Automation (ICRA), Stockholm, Sweden, 16–21 May 2016; pp. 3871–3877. [Google Scholar] [CrossRef]
Figure 1. Schematic of the ground-mounted snake-like robot platform affected (Tip) and unaffected (Tip ) by gravity.
Figure 1. Schematic of the ground-mounted snake-like robot platform affected (Tip) and unaffected (Tip ) by gravity.
Robotics 12 00002 g001
Figure 2. Parameters and reference frames for static modeling. (a) presents the forces and moments on link-i with respect to frame { i } . (b) presents the bending angle θ i 1 of joint- ( i 1 ) between link- ( i 1 ) and link-i. (c) presents the geometric parameters of link-i. Radius r is the distance between cable-j ( j = 1 , 2 , 3 , 4 ) and the center line of the body. Orientation α i is the angle between the center lines of the top and bottom cylindrical contact surfaces of link-i, which is also the angle between the planes formed by two pairs of opposing tendons inside the link.
Figure 2. Parameters and reference frames for static modeling. (a) presents the forces and moments on link-i with respect to frame { i } . (b) presents the bending angle θ i 1 of joint- ( i 1 ) between link- ( i 1 ) and link-i. (c) presents the geometric parameters of link-i. Radius r is the distance between cable-j ( j = 1 , 2 , 3 , 4 ) and the center line of the body. Orientation α i is the angle between the center lines of the top and bottom cylindrical contact surfaces of link-i, which is also the angle between the planes formed by two pairs of opposing tendons inside the link.
Robotics 12 00002 g002
Figure 3. Simulation processes of two example cases in ADAMS. In both cases, the materials used were steel and the robots were ground-mounted. (a) One of the planar-orientation cases ( α = 0 ). (b) One of the spatial-orientation cases ( α = 90 ).
Figure 3. Simulation processes of two example cases in ADAMS. In both cases, the materials used were steel and the robots were ground-mounted. (a) One of the planar-orientation cases ( α = 0 ). (b) One of the spatial-orientation cases ( α = 90 ).
Robotics 12 00002 g003
Figure 4. The setups and experiments for planar-motion cases in Table 3 where only one tension force was changed. (a) presents the setup with the ground-mounted robot in experiments 1, 2, and 3. (b) presents the initial state of the ground-mounted robot in the WCS with a total height of 162 mm. (ce) are the images captured in G-M experiments 1, 2, and 3, respectively. (f) presents the setup with the ceiling-mounted robot in experiments 4, 5, and 6. (g) presents the initial state of the ceiling-mounted robot in the WCS. (hj) are the images captured for C-M experiments 1, 2, and 3, respectively.
Figure 4. The setups and experiments for planar-motion cases in Table 3 where only one tension force was changed. (a) presents the setup with the ground-mounted robot in experiments 1, 2, and 3. (b) presents the initial state of the ground-mounted robot in the WCS with a total height of 162 mm. (ce) are the images captured in G-M experiments 1, 2, and 3, respectively. (f) presents the setup with the ceiling-mounted robot in experiments 4, 5, and 6. (g) presents the initial state of the ceiling-mounted robot in the WCS. (hj) are the images captured for C-M experiments 1, 2, and 3, respectively.
Robotics 12 00002 g004
Figure 5. Experiments for all spatial-motion cases where only one tension force remained unchanged. (a) is the image containing all the measured shapes of the ground-mounted snake-like robot under static equilibrium. { P 1 , P 2 , , P 9 } are the tip positions of the robot under different payloads shown in Table 4. (b,c) are the results of estimations with and without gravity compensation (GC) and the measurement in the experiments for (a). Similarly, (d) is the counterpart related to the ceiling-mounted robot. (e,f) are the corresponding results.
Figure 5. Experiments for all spatial-motion cases where only one tension force remained unchanged. (a) is the image containing all the measured shapes of the ground-mounted snake-like robot under static equilibrium. { P 1 , P 2 , , P 9 } are the tip positions of the robot under different payloads shown in Table 4. (b,c) are the results of estimations with and without gravity compensation (GC) and the measurement in the experiments for (a). Similarly, (d) is the counterpart related to the ceiling-mounted robot. (e,f) are the corresponding results.
Robotics 12 00002 g005
Table 1. Estimation and simulation results of bending angles and tip positions for planar-orientation cases.
Table 1. Estimation and simulation results of bending angles and tip positions for planar-orientation cases.
PlatformGround-Mounted CaseCeiling-Mounted Case
MaterialABSAluminumTitaniumSteelABSAluminumTitaniumSteel
ResultEst. * Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.
θ 1 ( ) 28.9931.9131.0636.5737.2941.4646.0150.4451.8626.2227.3622.3124.0218.7921.2613.5613.38
θ 2 ( ) 28.9931.2230.6534.6133.6337.9339.8043.2646.6126.8028.1223.6224.7020.6523.3216.0416.93
θ 3 ( ) 28.9930.2830.1332.0831.2033.5932.2435.3534.1027.6528.7325.5826.5823.5224.5820.1023.07
θ 4 ( ) 28.9929.5129.7430.1430.0730.5430.1330.6230.1928.4129.1827.4328.6426.3927.6624.5025.36
θ 5 ( ) 28.9929.1029.5329.2128.2029.2429.5029.1129.5128.8629.4128.6229.2828.3429.1727.8028.80
x(mm)47.0446.2346.1244.1644.7841.2639.7834.9833.2347.3946.7847.0546.9245.7846.5141.9442.32
y(mm)0.000.00−0.040.000.060.000.100.00−0.020.00−0.120.000.170.000.100.00−0.01
z(mm)14.8510.1911.163.454.02−2.67−6.31−11.45−13.3419.5516.7826.5423.2533.1227.9443.1140.43
Est.*: Estimation without gravity compensation [22]; Est.: Estimation with gravity compensation; Sim.: Simulation of ADAMS.
Table 2. Estimation and simulation results of bending angles and tip positions for spatial-orientation cases.
Table 2. Estimation and simulation results of bending angles and tip positions for spatial-orientation cases.
PlatformGround-Mounted CaseCeiling-Mounted Case
MaterialABSAluminumTitaniumSteelABSAluminumTitaniumSteel
ResultEst. * Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.Est.Sim.
θ 1 ( ) 10.5811.0811.3211.9212.6312.9413.6515.4017.1710.1210.069.479.288.848.617.777.68
θ 2 ( ) 15.4815.8817.3416.5418.3917.2819.4918.8921.2615.0916.2114.5115.4913.9414.7112.9013.48
θ 3 ( ) 10.5810.8511.2611.2911.8711.8212.5213.0813.7010.3310.669.9810.289.639.919.039.32
θ 4 ( ) 15.4815.6316.9715.8717.3516.1417.7516.7118.6515.3316.5515.1116.2714.8815.9714.4715.43
θ 5 ( ) 10.5810.6210.9910.6811.0510.7511.1510.9111.3410.5510.9010.5010.8610.4510.7810.3610.68
x(mm)18.5619.1319.6020.0921.0421.2322.1423.8825.5518.0218.2317.2417.2816.4816.5415.1715.36
y(mm)−18.47−18.82−20.61−19.37−21.49−19.99−22.33−21.30−23.71−18.14−19.67−17.64−19.02−17.13−18.36−16.20−17.25
z(mm)64.4164.0362.7063.3761.6062.5860.5960.6057.9164.7663.7265.2564.3765.7264.9366.5065.79
Est.*: Estimation without gravity compensation [22]; Est.: Estimation with gravity compensation; Sim.: Simulation of ADAMS.
Table 3. Estimated and measured results of bending angles for planar-motion cases.
Table 3. Estimated and measured results of bending angles for planar-motion cases.
Payloads(N)Experiment 1: [0.98,0.98,0.98,1.96].Experiment 2: [0.98,0.98,0.98,2.94].Experiment 3: [0.98,0.98,0.98,3.92].
ResultsEst*.1G-M Est.1G-M Exp.1C-M Est.1C-M Exp.1Est*.2G-M Est.2G-M Exp.2C-M Est.2C-M Exp.2Est*.3G-M Est.3G-M Exp.3C-M Est.3C-M Exp.3
θ 2 ( ) 8.9727.1726.494.164.1014.9731.3530.357.876.6419.2533.5332.5011.1611.23
θ 4 ( ) 8.9723.4222.934.854.8314.9727.8227.128.948.5019.2530.3329.3412.4411.79
θ 6 ( ) 8.9718.0718.496.026.3414.9722.8523.8110.7210.8219.2525.9025.8514.5313.67
θ 8 ( ) 8.9713.2313.787.387.7414.9718.5419.2412.7213.7019.2522.1622.1316.8016.31
θ 10 ( ) 8.9710.0610.198.538.8014.9715.8615.4614.3515.5819.2519.9620.3918.5818.18
x(mm)0.000.000.000.000.050.000.00−0.220.00−2.150.000.00−0.360.00−2.32
y(mm)−56.74−106.23−107.19−35.87−38.40−84.84−109.29−110.68−60.93−62.41−97.22−106.43−107.19−77.57−79.27
z(mm)145.5086.7985.44155.18155.12118.8658.2157.04140.94141.1695.1841.7040.42124.64125.09
Est.*: Estimation without gravity compensation [22]; Est.: Estimation with gravity compensation; Exp.: Experiment; G-M: Ground-Mounted case; C-M: Ceiling-Mounted case.
Table 4. Position errors (mm) between the estimated and measured tip positions for spatial-motion cases.
Table 4. Position errors (mm) between the estimated and measured tip positions for spatial-motion cases.
Tip No. P 1 P 2 P 3 P 4 P 5 P 6 P 7 P 8 P 9
Payload (N)[1.96, 1.96, 1.96, 6.86][6.86, 1.96, 1.96, 8.82][8.82, 1.96, 1.96, 6.86][6.86, 1.96, 1.96, 3.92][6.86, 1.96, 1.96, 1.96][6.86, 3.92, 1.96, 1.96][8.82, 6.86, 1.96, 1.96][6.86, 8.82, 1.96, 1.96][1.96, 6.86, 1.96, 1.96]
G-M Est. * 28.3921.8723.4232.7440.8632.6725.0321.7428.43
G-M Est.2.213.052.421.222.602.692.663.010.79
C-M Est. * 20.3415.0319.2520.7930.4020.8919.7620.1920.35
C-M Est.2.883.633.253.262.213.872.553.822.81
Est.*: Estimation without gravity compensation [22]; Est.: Estimation with gravity compensation; G-M: Ground- Mounted; C-M: Ceiling-Mounted.
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Hu, J.; Liu, T.; Zeng, H.; Chua, M.X.; Katupitiya, J.; Wu, L. Static Modeling of a Class of Stiffness-Adjustable Snake-like Robots with Gravity Compensation. Robotics 2023, 12, 2. https://doi.org/10.3390/robotics12010002

AMA Style

Hu J, Liu T, Zeng H, Chua MX, Katupitiya J, Wu L. Static Modeling of a Class of Stiffness-Adjustable Snake-like Robots with Gravity Compensation. Robotics. 2023; 12(1):2. https://doi.org/10.3390/robotics12010002

Chicago/Turabian Style

Hu, Jian, Tangyou Liu, Haijun Zeng, Ming Xuan Chua, Jayantha Katupitiya, and Liao Wu. 2023. "Static Modeling of a Class of Stiffness-Adjustable Snake-like Robots with Gravity Compensation" Robotics 12, no. 1: 2. https://doi.org/10.3390/robotics12010002

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop