Correspondence Analysis
# 載入必要套件
#install.packages("gridExtra")
#install.packages("ggpubr")
library(gridExtra)
library(ggpubr)
library(grid)  # 轉換圖形物件
CS <- conceptualStructure(dta,            #cleaned data
                         field = "DE",     #"DE"作者關鍵字
                         ngrams = 2,       #可訂1-3
                         method = "CA",    #Correspondence Analysis
                         minDegree = 4,    #至少出現4次
                         clust = "auto",   #可訂2-8
                         stemming = FALSE,  #TRUE=Porter’s Stemming algorithm 將同字根字詞合併成同一詞幹
                         labelsize = 4, 
                         documents = 100, #only for CA and MCA
                         graph = FALSE)
CS
$net
                                                                                                                                                                  biped robot
                                                                                                                                                                  locomotion
                                                                                                                                                                  humanoid robot
                                                                                                                                                                  biped walking
                                                                                                                                                                  legged locomotion
                                                                                                                                                                  biped robots
                                                                                                                                                                  humanoid robots
                                                                                                                                                                  legged robots
                                                                                                                                                                  biped locomotion
                                                                                                                                                                  biped
                                                                                                                                                                  zmp
                                                                                                                                                                  robotics
                                                                                                                                                                  reinforcement learning
                                                                                                                                                                  stability
                                                                                                                                                                  bipedal robot
                                                                                                                                                                  passive dynamic walking
                                                                                                                                                                  humanoid
                                                                                                                                                                  central pattern generator
                                                                                                                                                                  zero moment point
                                                                                                                                                                  gait planning
                                                                                                                                                                  simulation
                                                                                                                                                                  bipedal walking
                                                                                                                                                                  bipedal locomotion
                                                                                                                                                                  optimization
                                                                                                                                                                  quadruped robot
                                                                                                                                                                  kinematics
                                                                                                                                                                  control
                                                                                                                                                                  dynamics
                                                                                                                                                                  walking
                                                                                                                                                                  dynamic walking
                                                                                                                                                                  motion control
                                                                                                                                                                  motion planning
                                                                                                                                                                  robot
                                                                                                                                                                  genetic algorithm
                                                                                                                                                                  trajectory planning
                                                                                                                                                                  biped walking robot
                                                                                                                                                                  gait
                                                                                                                                                                  legged robot
                                                                                                                                                                  inverse kinematics
                                                                                                                                                                  limit cycle
                                                                                                                                                                  balance control
                                                                                                                                                                  bipeds
                                                                                                                                                                  walking robot
                                                                                                                                                                  central pattern generator (cpg)
                                                                                                                                                                  bipedal robots
                                                                                                                                                                  path planning
                                                                                                                                                                  gait generation
                                                                                                                                                                  model predictive control
                                                                                                                                                                  passive walking
                                                                                                                                                                  push recovery
                                                                                                                                                                  force control
                                                                                                                                                                  hybrid systems
                                                                                                                                                                  humanoid and bipedal locomotion
                                                                                                                                                                  optimal control
                                                                                                                                                                  zero moment point (zmp)
                                                                                                                                                                  energy efficiency
                                                                                                                                                                  mobile robots
                                                                                                                                                                  walking gait
                                                                                                                                                                  trajectory generation
                                                                                                                                                                  biomechanics
                                                                                                                                                                  cpg
                                                                                                                                                                  mobile robot
                                                                                                                                                                  neural network
                                                                                                                                                                  adaptive control
                                                                                                                                                                  uneven terrain
                                                                                                                                                                  running
                                                                                                                                                                  walking control
                                                                                                                                                                  walking pattern generation
                                                                                                                                                                  walking robots
                                                                                                                                                                  compliance
                                                                                                                                                                  poincaré map
                                                                                                                                                                  quadruped locomotion
                                                                                                                                                                  snake robot
                                                                                                                                                                  balance
                                                                                                                                                                  inverted pendulum
                                                                                                                                                                  nonlinear control
                                                                                                                                                                  robots
                                                                                                                                                                  central pattern generators
                                                                                                                                                                  chaos
                                                                                                                                                                  mechanism design
                                                                                                                                                                  stability analysis
                                                                                                                                                                  walking pattern
                                                                                                                                                                  biped humanoid robot
                                                                                                                                                                  gait transition
                                                                                                                                                                  modeling
                                                                                                                                                                  robot dynamics
                                                                                                                                                                  dynamic simulation
                                                                                                                                                                  impedance control
                                                                                                                                                                  trajectory
                                                                                                                                                                  biomimetics
                                                                                                                                                                  exoskeleton
                                                                                                                                                                  gait analysis
                                                                                                                                                                  hybrid zero dynamics
                                                                                                                                                                  locomotion control
                                                                                                                                                                  mechanical design
                                                                                                                                                                  parallel mechanism
                                                                                                                                                                  robot control
                                                                                                                                                                  robot kinematics
                                                                                                                                                                  robust control
                                                                                                                                                                  snake-like robot
                                                                                                                                                                  biologically-inspired robots
                                                                                                                                                                  evolutionary robotics
                                                                                                                                                                  foot
                                                                                                                                                                  genetic algorithms
                                                                                                                                                                  neural networks
                                                                                                                                                                  neural oscillator
                                                                                                                                                                  robot design
                                                                                                                                                                  soft robotics
                                                                                                                                                                  underactuated robots
                                                                                                                                                                  bifurcation
                                                                                                                                                                  dynamic stability
                                                                                                                                                                  lipm
                                                                                                                                                                  modular robot
                                                                                                                                                                  preview control
                                                                                                                                                                  climbing robot
                                                                                                                                                                  deep reinforcement learning
                                                                                                                                                                  dynamic modeling
                                                                                                                                                                  humanoid robotics
                                                                                                                                                                  limit cycle walking
                                                                                                                                                                  machine learning
                                                                                                                                                                  obstacle avoidance
                                                                                                                                                                  quadruped
                                                                                                                                                                  robustness
                                                                                                                                                                  climbing robots
                                                                                                                                                                  compliance control
                                                                                                                                                                  design
                                                                                                                                                                  distributed control
                                                                                                                                                                  dynamic model
                                                                                                                                                                  friction
                                                                                                                                                                  gait optimization
                                                                                                                                                                  leg
                                                                                                                                                                  particle swarm optimization
                                                                                                                                                                  rough terrain
                                                                                                                                                                  sliding mode control
                                                                                                                                                                  zero-moment point
                                                                                                                                                                  bipedal
                                                                                                                                                                  dynamic analysis
                                                                                                                                                                  hexapod
                                                                                                                                                                  hexapod robot
                                                                                                                                                                  posture control
                                                                                                                                                                  actuators
                                                                                                                                                                  angular momentum
                                                                                                                                                                  basin of attraction
                                                                                                                                                                  double support phase
                                                                                                                                                                  inverted pendulum model
                                                                                                                                                                  microrobot
                                                                                                                                                                  undulatory locomotion
                                                                                                                                                                  whole-body control
                                                                                                                                                                  zero dynamics
                                                                                                                                                                  biomimetic robots
                                                                                                                                                                  center of mass
                                                                                                                                                                  force sensor
                                                                                                                                                                  gait design
                                                                                                                                                                  ground reaction force
                                                                                                                                                                  learning control
                                                                                                                                                                  learning from demonstration
                                                                                                                                                                  limit cycles
                                                                                                                                                                  passive dynamics
                                                                                                                                                                  q-learning
                                                                                                                                                                  rehabilitation
                                                                                                                                                                  variable stiffness
                                                                                                                                                                  bio-inspired
                                                                                                                                                                  biped gait
                                                                                                                                                                  fuzzy control
                                                                                                                                                                  gait cycle
                                                                                                                                                                  imitation learning
                                                                                                                                                                  impact
                                                                                                                                                                  matlab
                                                                                                                                                                  modelling
                                                                                                                                                                  optimization and optimal control
                                                                                                                                                                  single support phase
                                                                                                                                                                  soft robot
                                                                                                                                                                  stable walking
                                                                                                                                                                  underactuation
                                                                                                                                                                  bio-inspired robot
                                                                                                                                                                  bio-inspired robotics
                                                                                                                                                                  bipedal walking robot
                                                                                                                                                                  compensatory motion
                                                                                                                                                                  disturbance rejection
                                                                                                                                                                  feedback control
                                                                                                                                                                  gait synthesis
                                                                                                                                                                  human locomotion
                                                                                                                                                                  humans
                                                                                                                                                                  learning
                                                                                                                                                                  linear inverted pendulum model
                                                                                                                                                                  pneumatic artificial muscle
                                                                                                                                                                  robot sensing systems
                                                                                                                                                                  stabilization
                                                                                                                                                                  trajectory optimization
                                                                                                                                                                  zero-moment point (zmp)
                                                                                                                                                                  capture point
                                                                                                                                                                  footstep planning
                                                                                                                                                                  gait control
                                                                                                                                                                  human-robot interaction
                                                                                                                                                                  modular robots
                                                                                                                                                                  motion capture
                                                                                                                                                                  multi-objective optimization
                                                                                                                                                                  navigation
                                                                                                                                                                  orbital stability
                                                                                                                                                                  rehabilitation robotics
                                                                                                                                                                  sensor fusion
                                                                                                                                                                  shape memory alloy
                                                                                                                                                                  teleoperation
                                                                                                                                                                  walking machines
                                                                                                                                                                  walking speed
                                                                                                                                                                  wall-climbing robot
                                                                                                                                                                  artificial intelligence
                                                                                                                                                                  biped robot with heterogeneous legs
                                                                                                                                                                  dynamic
                                                                                                                                                                  dynamic balance
                                                                                                                                                                  efficiency
                                                                                                                                                                  energy consumption
                                                                                                                                                                  hubo
                                                                                                                                                                  human walking
                                                                                                                                                                  inverse dynamics
                                                                                                                                                                  manipulation
                                                                                                                                                                  mechatronics
                                                                                                                                                                  model predictive control (mpc)
                                                                                                                                                                  motion generation
                                                                                                                                                                  multibody dynamics
                                                                                                                                                                  oscillator
                                                                                                                                                                  pid controller
                                                                                                                                                                  pso
                                                                                                                                                                  quadratic programming
                                                                                                                                                                  reconfigurable robot
                                                                                                                                                                  robot learning
                                                                                                                                                                  tracking
                                                                                                                                                                  underactuated system
                                                                                                                                                                  walking stability
                                                                                                                                                                  ankle joint
                                                                                                                                                                  biomimetic robot
                                                                                                                                                                  collision avoidance
                                                                                                                                                                  compass-gait biped robot
                                                                                                                                                                  control of robotic systems
                                                                                                                                                                  control strategy
                                                                                                                                                                  control system
                                                                                                                                                                  decentralized control
                                                                                                                                                                  deep learning
                                                                                                                                                                  degrees of freedom
                                                                                                                                                                  feedback linearization
                                                                                                                                                                  fish robot
                                                                                                                                                                  fuzzy logic
                                                                                                                                                                  gait pattern generation
                                                                                                                                                                  hopping
                                                                                                                                                                  human biomechanics
                                                                                                                                                                  human gait
                                                                                                                                                                  humanoid walking
                                                                                                                                                                  humanoids
                                                                                                                                                                  jumping
                                                                                                                                                                  kalman filter
                                                                                                                                                                  kinematic analysis
                                                                                                                                                                  linear inverted pendulum
                                                                                                                                                                  mathematical model
                                                                                                                                                                  passivity
                                                                                                                                                                  phase resetting
                                                                                                                                                                  poincare map
                                                                                                                                                                  reflexes
                                                                                                                                                                  robot locomotion
                                                                                                                                                                  robotic fish
                                                                                                                                                                  screw theory
                                                                                                                                                                  sensors
                                                                                                                                                                  spring-loaded inverted pendulum
                                                                                                                                                                  stability control
                                                                                                                                                                  trajectory tracking
                                                                                                                                                                  underactuated
                                                                                                                                                                  adaptive behavior
                                                                                                                                                                  arduino
                                                                                                                                                                  autonomous robots
                                                                                                                                                                  balance recovery
                                                                                                                                                                  bioinspired robot
                                                                                                                                                                  biologically inspired robots
                                                                                                                                                                  biped mechanism
                                                                                                                                                                  biped walk
                                                                                                                                                                  control systems
                                                                                                                                                                  cpgs
                                                                                                                                                                  dynamic control
                                                                                                                                                                  earthworm
                                                                                                                                                                  force
                                                                                                                                                                  gait pattern
                                                                                                                                                                  hybrid system
                                                                                                                                                                  image processing
                                                                                                                                                                  imitation
                                                                                                                                                                  iterative learning control
                                                                                                                                                                  localization
                                                                                                                                                                  lyapunov exponents
                                                                                                                                                                  motion analysis
                                                                                                                                                                  muscles
                                                                                                                                                                  nonlinear systems
                                                                                                                                                                  pattern generation
                                                                                                                                                                  quadruped walking
                                                                                                                                                                  robocup
                                                                                                                                                                  simmechanics
                                                                                                                                                                  soft robot materials and design
                                                                                                                                                                  soft robots
                                                                                                                                                                  state estimation
                                                                                                                                                                  synchronization
                                                                                                                                                                  system identification
                                                                                                                                                                  underactuated mechanical systems
                                                                                                                                                                  underactuated systems
                                                                                                                                                                  upper body
                                                                                                                                                                  virtual constraints
                                                                                                                                                                  virtual holonomic constraints
                                                                                                                                                                  zmp (zero moment point)
                                                                                                                                                                  3d printing
                                                                                                                                                                  adaptive walking
                                                                                                                                                                  adhesion
                                                                                                                                                                  amphibious robot
                                                                                                                                                                  artificial leg
                                                                                                                                                                  biologically inspired control
                                                                                                                                                                  biomimetic
                                                                                                                                                                  biorobotics
                                                                                                                                                                  bipedal robotics
                                                                                                                                                                  center of pressure
                                                                                                                                                                  compass gait
                                                                                                                                                                  contact force
                                                                                                                                                                  cost of transport
                                                                                                                                                                  disturbance observer
                                                                                                                                                                  divergent component of motion
                                                                                                                                                                  dynamic gait
                                                                                                                                                                  dynamic walk
                                                                                                                                                                  energy
                                                                                                                                                                  extended kalman filter
                                                                                                                                                                  foot mechanism
                                                                                                                                                                  forward kinematics
                                                                                                                                                                  fpga
                                                                                                                                                                  gait stability
                                                                                                                                                                  genetic algorithm (ga)
                                                                                                                                                                  icpf actuator
                                                                                                                                                                  kinematic
                                                                                                                                                                  locomotion analysis
                                                                                                                                                                  lqr
                                                                                                                                                                  mechanical systems
                                                                                                                                                                  motor control
                                                                                                                                                                  neural control
                                                                                                                                                                  nonlinear oscillators
                                                                                                                                                                  optimal gait
                                                                                                                                                                  optimal trajectory
                                                                                                                                                                  parametric excitation
                                                                                                                                                                  pneumatic actuator
                                                                                                                                                                  postural stability
                                                                                                                                                                  propulsion
                                                                                                                                                                  proximal policy optimization
                                                                                                                                                                  quadrupedal locomotion
                                                                                                                                                                  robot soccer
                                                                                                                                                                  robotic
                                                                                                                                                                  series elastic actuator
                                                                                                                                                                  simulink
                                                                                                                                                                  slip
                                                                                                                                                                  slipping
                                                                                                                                                                  sloping surface
                                                                                                                                                                  soft robot applications
                                                                                                                                                                  support polygon
                                                                                                                                                                  svr
                                                                                                                                                                  turning
                                                                                                                                                                  whole body control
                                                                                                                                                                  acceleration
                                                                                                                                                                  arm swing
                                                                                                                                                                  artificial muscle
                                                                                                                                                                  artificial neural network
                                                                                                                                                                  artificial neural networks
                                                                                                                                                                  asymptotic stability
                                                                                                                                                                  balancing
                                                                                                                                                                  balancing control
                                                                                                                                                                  bio-inspiration
                                                                                                                                                                  biomimetic robotics
                                                                                                                                                                  biped locomotion robot
                                                                                                                                                                  biped robot locomotion
                                                                                                                                                                  biped walker
                                                                                                                                                                  bipedal robotic walking
                                                                                                                                                                  central pattern generator(cpg)
                                                                                                                                                                  chaos control
                                                                                                                                                                  climbing stairs
                                                                                                                                                                  compliant leg
                                                                                                                                                                  dsp
                                                                                                                                                                  dynamic bipedal walking
                                                                                                                                                                  evolutionary algorithms
                                                                                                                                                                  exoskeletons
                                                                                                                                                                  fuzzy controller
                                                                                                                                                                  gait learning
                                                                                                                                                                  gait model
                                                                                                                                                                  hierarchical control
                                                                                                                                                                  hip
                                                                                                                                                                  human
                                                                                                                                                                  inertial measurement unit (imu)
                                                                                                                                                                  interlimb coordination
                                                                                                                                                                  ipmc
                                                                                                                                                                  jumping robot
                                                                                                                                                                  kinematic model
                                                                                                                                                                  linear inverted pendulum model (lipm)
                                                                                                                                                                  mechanism
                                                                                                                                                                  micro-robot
                                                                                                                                                                  micro biped robot
                                                                                                                                                                  mobility
                                                                                                                                                                  model
                                                                                                                                                                  motion
                                                                                                                                                                  nao
                                                                                                                                                                  natural dynamics
                                                                                                                                                                  nonlinear dynamics
                                                                                                                                                                  online learning
                                                                                                                                                                  optimal design
                                                                                                                                                                  optimal trajectory planning
                                                                                                                                                                  parametric optimization
                                                                                                                                                                  passive dynamic walker
                                                                                                                                                                  policy gradient
                                                                                                                                                                  position control
                                                                                                                                                                  predictive control
                                                                                                                                                                  pushing motion
                                                                                                                                                                  robot motion
                                                                                                                                                                  robust walking
                                                                                                                                                                  sensor
                                                                                                                                                                  sensory feedback
                                                                                                                                                                  servo motor
                                                                                                                                                                  stability criterion
                                                                                                                                                                  stair climbing
                                                                                                                                                                  staircase
                                                                                                                                                                  stairs
                                                                                                                                                                  stiffness
                                                                                                                                                                  stretch walking
                                                                                                                                                                  support vector machine
                                                                                                                                                                  support vector regression (svr)
                                                                                                                                                                  swing phase
                                                                                                                                                                  symmetry
                                                                                                                                                                  tensegrity
                                                                                                                                                                  torque control
                                                                                                                                                                  torso
                                                                                                                                                                  virtual model control
                                                                                                                                                                  vision
                                                                                                                                                                  wearable robot
                                                                                                                                                                  wheeled robot
                                                                                                                                                                  yaw moment
                                                                                                                                                                  3-d linear inverted pendulum model (lipm)
                                                                                                                                                                  3d
                                                                                                                                                                  3d biped robot
                                                                                                                                                                  adams simulation
                                                                                                                                                                  bayesian optimization
                                                                                                                                                                  bifurcations
                                                                                                                                                                  bio-inspired design
                                                                                                                                                                  bioinspired robotics
                                                                                                                                                                  bionic robot
                                                                                                                                                                  biped climbing robot
                                                                                                                                                                  biped control
                                                                                                                                                                  biped locomotor
                                                                                                                                                                  biped robot walking
                                                                                                                                                                  biped robotics
                                                                                                                                                                  bipedal walk
                                                                                                                                                                  capturability
                                                                                                                                                                  compass biped robot
                                                                                                                                                                  computer simulation
                                                                                                                                                                  contact
                                                                                                                                                                  contact modeling
                                                                                                                                                                  control algorithm
                                                                                                                                                                  control architecture
                                                                                                                                                                  control lyapunov function
                                                                                                                                                                  coordination
                                                                                                                                                                  cop
                                                                                                                                                                  cyclic-fold bifurcation
                                                                                                                                                                  damping
                                                                                                                                                                  deep deterministic policy gradient
                                                                                                                                                                  ditch crossing
                                                                                                                                                                  dynamic balance margin
                                                                                                                                                                  dynamic locomotion
                                                                                                                                                                  dynamics modeling
                                                                                                                                                                  dynamics of walking
                                                                                                                                                                  dynamics simulation
                                                                                                                                                                  embedded systems
                                                                                                                                                                  embodiment
                                                                                                                                                                  experimental validation
                                                                                                                                                                  external force
                                                                                                                                                                  feedforward control
                                                                                                                                                                  fixed point
                                                                                                                                                                  foot placement
                                                                                                                                                                  function approximation technique
                                                                                                                                                                  gait generator
                                                                                                                                                                  gorilla robot
                                                                                                                                                                  gravity compensation
                                                                                                                                                                  human-carrying robot
                                                                                                                                                                  human-like biped gait
                                                                                                                                                                  hybrid control
                                                                                                                                                                  impedance
                                                                                                                                                                  imu
                                                                                                                                                                  inclined plane
                                                                                                                                                                  inspection
                                                                                                                                                                  intelligent bionic leg
                                                                                                                                                                  interaction
                                                                                                                                                                  khr-2
                                                                                                                                                                  kinematics analysis
                                                                                                                                                                  lateral undulation
                                                                                                                                                                  leg mechanisms
                                                                                                                                                                  legged
                                                                                                                                                                  locking mechanism
                                                                                                                                                                  locomotion gait
                                                                                                                                                                  locomotion pattern
                                                                                                                                                                  mechanical engineering
                                                                                                                                                                  mechanical structure
                                                                                                                                                                  mechanics
                                                                                                                                                                  microactuator
                                                                                                                                                                  mobile robotics
                                                                                                                                                                  motion primitives
                                                                                                                                                                  nao robot
                                                                                                                                                                  natural walking
                                                                                                                                                                  neural controller
                                                                                                                                                                  nonlinear model predictive control
                                                                                                                                                                  obstacle crossing
                                                                                                                                                                  online trajectory generation
                                                                                                                                                                  optimisation
                                                                                                                                                                  parallel leg mechanism
                                                                                                                                                                  parameter optimization
                                                                                                                                                                  particle filter
                                                                                                                                                                  passive dynamic walk
                                                                                                                                                                  passive gait
                                                                                                                                                                  pd controller
                                                                                                                                                                  performance analysis
                                                                                                                                                                  periodic motion
                                                                                                                                                                  pid
                                                                                                                                                                  piezoelectric
                                                                                                                                                                  piezoelectric actuator
                                                                                                                                                                  planning
                                                                                                                                                                  pneumatic actuation
                                                                                                                                                                  postural control
                                                                                                                                                                  power consumption
                                                                                                                                                                  prosthetics
                                                                                                                                                                  prototypes
                                                                                                                                                                  quadruped robots
                                                                                                                                                                  quadrupeds
                                                                                                                                                                  redundancy
                                                                                                                                                                  redundant leg
                                                                                                                                                                  redundant robots
                                                                                                                                                                  sagittal gait
                                                                                                                                                                  sensory information
                                                                                                                                                                  slip model
                                                                                                                                                                  snake locomotion
                                                                                                                                                                  springs
                                                                                                                                                                  stability margin
                                                                                                                                                                  stability region
                                                                                                                                                                  static gait
                                                                                                                                                                  static walking
                                                                                                                                                                  toe
                                                                                                                                                                  torque
                                                                                                                                                                  trajectory generator
                                                                                                                                                                  under-actuated biped robot
                                                                                                                                                                  viability
                                                                                                                                                                  virtual prototype
                                                                                                                                                                  virtual reality
                                                                                                                                                                  walking locomotion
                                                                                                                                                                  walking trajectory
                                                                                                                                                                  wall climbing robot
                                                                                                                                                                  wearable robots
                                                                                                                                                                  wheeled locomotion
                                                                                                                                                                  3d-lipm
                                                                                                                                                                  3d bipedal robot
                                                                                                                                                                  3d walking
                                                                                                                                                                  5-link biped robot
                                                                                                                                                                  active force control
                                                                                                                                                                  actuator
                                                                                                                                                                  adaptation
                                                                                                                                                                  admittance control
                                                                                                                                                                  algorithm
                                                                                                                                                                  ankle stiffness
                                                                                                                                                                  arduino uno
                                                                                                                                                                  artificial muscles
                                                                                                                                                                  ascending and descending gaits
                                                                                                                                                                  autonomous robot
                                                                                                                                                                  bio-inspired robots
                                                                                                                                                                  bioinspiration
                                                                                                                                                                  bioinspired
                                                                                                                                                                  biologically inspired robotics
                                                                                                                                                                  biomimicry
                                                                                                                                                                  biped humanoid robots
                                                                                                                                                                  biped system
                                                                                                                                                                  biped walking machine
                                                                                                                                                                  bipedal gait
                                                                                                                                                                  bipedal robot locomotion
                                                                                                                                                                  bounding locomotion
                                                                                                                                                                  brhl
                                                                                                                                                                  caterpillar
                                                                                                                                                                  center of gravity
                                                                                                                                                                  center of mass (com)
                                                                                                                                                                  compass-gait biped model
                                                                                                                                                                  compass-like biped
                                                                                                                                                                  compliant actuation
                                                                                                                                                                  compliant ground
                                                                                                                                                                  compliant mechanisms
                                                                                                                                                                  computed-torque control
                                                                                                                                                                  computed torque control
                                                                                                                                                                  computer vision
                                                                                                                                                                  constraint
                                                                                                                                                                  contact dynamics
                                                                                                                                                                  control technology
                                                                                                                                                                  controlled poincaré map
                                                                                                                                                                  controller
                                                                                                                                                                  cooperative control
                                                                                                                                                                  crawl
                                                                                                                                                                  cubic spline interpolation
                                                                                                                                                                  cyclic walking gait
                                                                                                                                                                  dead reckoning
                                                                                                                                                                  deformation
                                                                                                                                                                  degree of freedom
                                                                                                                                                                  degree of freedom (dof)
                                                                                                                                                                  delayed feedback control
                                                                                                                                                                  design engineering
                                                                                                                                                                  differential evolution
                                                                                                                                                                  dynamic optimization
                                                                                                                                                                  dynamical systems
                                                                                                                                                                  dynamically balanced gait
                                                                                                                                                                  dynamics model
                                                                                                                                                                  eap
                                                                                                                                                                  earthworm-like robot
                                                                                                                                                                  efficient gait
                                                                                                                                                                  energetics
                                                                                                                                                                  energy control
                                                                                                                                                                  energy optimization
                                                                                                                                                                  energy shaping
                                                                                                                                                                  entertainment
                                                                                                                                                                  evolutionary algorithm
                                                                                                                                                                  exploration
                                                                                                                                                                  fast marching method
                                                                                                                                                                  feedback network
                                                                                                                                                                  finite state machine
                                                                                                                                                                  foot rotation
                                                                                                                                                                  foot trajectory
                                                                                                                                                                  four-legged robot
                                                                                                                                                                  fuzzy
                                                                                                                                                                  fuzzy logic control
                                                                                                                                                                  fuzzy systems
                                                                                                                                                                  gait adaptation
                                                                                                                                                                  gait rehabilitation
                                                                                                                                                                  gait tracking
                                                                                                                                                                  gait trajectory
                                                                                                                                                                  gallop
                                                                                                                                                                  genetic-fuzzy system
                                                                                                                                                                  genetic programming
                                                                                                                                                                  geometric mechanics
                                                                                                                                                                  ground reaction forces
                                                                                                                                                                  human motion
                                                                                                                                                                  hybrid locomotion
                                                                                                                                                                  hybrid zero dynamics (hzd)
                                                                                                                                                                  hydrodynamics
                                                                                                                                                                  impact dynamics
                                                                                                                                                                  impulsive hybrid system
                                                                                                                                                                  interface
                                                                                                                                                                  joint
                                                                                                                                                                  jump
                                                                                                                                                                  khr-3
                                                                                                                                                                  kinect
                                                                                                                                                                  landing control
                                                                                                                                                                  leg-wheel robot
                                                                                                                                                                  limbs
                                                                                                                                                                  linear actuator
                                                                                                                                                                  linear quadratic regulator
                                                                                                                                                                  lstm
                                                                                                                                                                  lyapunov stability
                                                                                                                                                                  mathematical modeling
                                                                                                                                                                  mechanical energy
                                                                                                                                                                  metatarsophalangeal joint
                                                                                                                                                                  micro robot
                                                                                                                                                                  model learning for control
                                                                                                                                                                  modifiable walking pattern generator (mwpg)
                                                                                                                                                                  modular
                                                                                                                                                                  morphological computation
                                                                                                                                                                  morphology
                                                                                                                                                                  motion imitation
                                                                                                                                                                  movement primitives
                                                                                                                                                                  multibody system
                                                                                                                                                                  multimodal locomotion
                                                                                                                                                                  musculoskeletal robot
                                                                                                                                                                  natural machine motion
                                                                                                                                                                  neuro-fuzzy control
                                                                                                                                                                  neuro-fuzzy systems
                                                                                                                                                                  nmpc
                                                                                                                                                                  nonlinear system
                                                                                                                                                                  numerical simulation
                                                                                                                                                                  omnidirectional walk
                                                                                                                                                                  operational space control
                                                                                                                                                                  orbital stabilization
                                                                                                                                                                  oscillators
                                                                                                                                                                  parallel robots
                                                                                                                                                                  partial feedback linearization
                                                                                                                                                                  passive compliance
                                                                                                                                                                  passive walker
                                                                                                                                                                  passivity-based control
                                                                                                                                                                  perception
                                                                                                                                                                  periodic gait
                                                                                                                                                                  phase reset
                                                                                                                                                                  pid control
                                                                                                                                                                  planar biped robot
                                                                                                                                                                  pneumatic actuators
                                                                                                                                                                  poincaré return map
                                                                                                                                                                  poincaré sections
                                                                                                                                                                  policy gradient learning
                                                                                                                                                                  polychaete annelids
                                                                                                                                                                  posture
                                                                                                                                                                  prosthesis
                                                                                                                                                                  push-off
                                                                                                                                                                  quadrupedal robot
                                                                                                                                                                  reactive control
                                                                                                                                                                  recurrent neural network
                                                                                                                                                                  recurrent neural networks
                                                                                                                                                                  rimless wheel
                                                                                                                                                                  robot operating system
                                                                                                                                                                  robot vision
                                                                                                                                                                  robot walking
                                                                                                                                                                  robotic foot
                                                                                                                                                                  robotic leg
                                                                                                                                                                  ros
                                                                                                                                                                  safety
                                                                                                                                                                  sagittal plane
                                                                                                                                                                  self-organized locomotion
                                                                                                                                                                  semi-passive dynamic walking
                                                                                                                                                                  semi-passive walking
                                                                                                                                                                  sensorimotor loop
                                                                                                                                                                  series elastic actuation
                                                                                                                                                                  service robots
                                                                                                                                                                  servo
                                                                                                                                                                  simulated annealing
                                                                                                                                                                  slope
                                                                                                                                                                  snake robots
                                                                                                                                                                  space robot
                                                                                                                                                                  spiking neural networks
                                                                                                                                                                  spinal cord injury
                                                                                                                                                                  spring
                                                                                                                                                                  stability of hybrid systems
                                                                                                                                                                  state feedback
                                                                                                                                                                  steering
                                                                                                                                                                  stepping
                                                                                                                                                                  structure optimization
                                                                                                                                                                  tactile sensor
                                                                                                                                                                  teaching material
                                                                                                                                                                  toe joint
                                                                                                                                                                  torso control
                                                                                                                                                                  tracking control
                                                                                                                                                                  trajectories
                                                                                                                                                                  transverse linearization
                                                                                                                                                                  truncated fourier series
                                                                                                                                                                  under-actuated system
                                                                                                                                                                  underactuated robot
                                                                                                                                                                  various walking motions
                                                                                                                                                                  velocity control
                                                                                                                                                                  vibration
                                                                                                                                                                  virtual gravity
                                                                                                                                                                  virtual leg
                                                                                                                                                                  visual servoing
                                                                                                                                                                  wabian-2r
                                                                                                                                                                  walking biped
                                                                                                                                                                  walking experiment
                                                                                                                                                                  walking motion
                                                                                                                                                                  walking patterns
                                                                                                                                                                  walking planning
                                                                                                                                                                  walking stabilization
                                                                                                                                                                  whole-body dynamics
                                                                                                                                                                  wobbling mass
                                                                                                                                                                  workspace
                                                                                                                                                                  zero-moment-point
                                                                                                                                                                  zmp control
 [ 達到了 getOption("max.print") -- 省略最後 4273 列 ]]
$res
 Principal inertias (eigenvalues):
           1       2        3        4        5        6        7        8      
           9        10       11       12       13       14      15      
           16       17       18       19       20       21       22      
           23       24       25       26       27       28       29      
           30       31       32     33       34       35       36       37      
           38       39      40       41       42       43       44      
           45       46       47       48       49       50       51      
           52      53       54       55       56       57       58      59     
           60       61       62       63       64       65       66      
           67       68       69      70       71       72       73      
           74       75       76       77       78       79      80      
           81       82       83       84       85       86       87      
           88       89       90       91       92       93       94      
           95       96       97      98       99       100      101     
           102      103     104      105      106      107      108     
           109      110      111      112      113      114      115     
           116     117      118      119      120      121      122     
           123      124      125      126      127      128      129     
           130      131      132      133      134      135      136     
           137      138      139      140      141      142     143     
           144      145      146      147      148      149      150    151     
           152      153      154      155     156      157      158     
           159      160      161      162      163      164     165     
           166      167      168      169      170      171      172     
           173      174     175      176      177      178      179    180     
           181      182     183     184      185      186      187     188     
           189      190      191      192     193      194      195     
           196      197      198      199      200      201      202     
           203      204      205      206      207      208      209     
           210      211      212      213      214     215      216     
           217      218     219      220      221      222      223     
           224      225     226     227      228      229     230      231     
           232      233     234      235      236      237      238     
           239      240      241      242      243      244      245    
           246      247      248      249     250      251      252     
           253      254     255      256      257      258      259     
           260      261      262      263      264      265      266     
           267      268      269      270      271      272      273     
           274      275      276      277      278      279      280    
           281      282      283      284     285      286      287     
           288      289      290      291      292      293      294     
           295      296      297      298     299      300      301     
           302      303      304      305      306      307     308     
           309      310      311      312     313      314      315     
           316      317      318      319      320      321      322     323    
           324      325      326      327      328      329      330     
           331      332      333      334      335     336      337     
           338      339      340      341      342      343      344     
           345      346      347      348      349      350      351     
           352      353      354      355      356      357      358     
           359      360      361      362     363      364      365      366    
           367      368      369      370      371    372      373      374     
           375      376      377     378      379      380      381     
           382      383      384      385      386      387      388    
           389      390      391      392      393      394      395     
           396      397      398      399      400     401      402     
           403      404      405     406      407      408      409     
           410      411      412      413      414      415      416     
           417     418      419      420      421      422      423     
           424      425      426      427      428      429     430     
           431      432      433      434      435      436     437     
           438      439      440     441     442      443      444      445     
           446      447      448      449      450      451      452     
           453      454      455      456      457      458      459     
           460      461      462      463      464      465      466     
           467      468      469      470      471      472      473     
           474      475      476      477      478      479     480      481    
           482      483      484      485      486      487      488     
           489      490      491      492      493      494      495     
           496      497      498      499      500      501      502     
           503      504      505      506      507      508    509      510     
           511      512      513      514      515      516      517     
           518      519      520      521      522      523      524     
           525      526      527      528      529      530     531      532   
           533      534      535      536      537      538      539     
           540      541      542      543      544      545      546     
           547      548      549      550    551      552     553      554     
           555      556      557      558      559     560      561     
           562      563      564      565      566      567      568     569    
           570      571      572      573      574      575      576     
           577      578      579     580      581      582      583      584   
           585      586      587     588      589      590     591      592     
           593      594      595      596      597      598      599     
           600      601      602      603      604      605      606     
           607      608      609      610      611      612      613     
           614      615      616      617      618      619      620     
           621      622      623      624      625      626      627     
           628      629      630      631      632      633      634     
           635      636      637      638      639      640      641     
           642      643      644      645      646      647      648     
           649      650      651      652      653      654      655     
           656      657      658      659      660      661      662     
           663     664      665      666      667      668      669     
           670      671      672      673     674      675      676     
           677      678      679      680      681      682      683     
           684     685      686      687      688      689      690     
           691      692      693      694      695      696      697     
           698      699      700      701      702      703      704     
           705      706     707      708      709      710      711     
           712      713      714      715      716      717     718     
           719      720      721      722     723      724      725     
           726      727      728      729      730      731      732     
           733      734      735      736      737      738      739    
           740      741      742      743      744      745      746     
           747      748      749      750      751      752     
 [ 達到了 getOption("max.print") -- 省略最後 2 列 ]]
 Rows:
        chen k, 2024, ifac-papersonline srinivasan v, 2024, ifac-papersonline
        centeno-barreda d, 2024, robotica jaber z, 2024, int j adv rob syst
        budanov vm, 2024, j comput syst sci int liu x, 2024, rob autom syst
        mao n, 2024, robotica wei z, 2024, electronics (switzerland)
        jiang j, 2024, smart mater struct
        urbina-meléndez d, 2024, bioinspir biomimetics
        tovarnov ms, 2024, rob autom syst arefi r, 2024, j mech sci technol
        xie z, 2024, mech mach theory godon s, 2024, bioinspir biomimetics
        khandelwal a, 2024, ifac-papersonline
        lerner e, 2024, philos trans r soc a math phys eng sci
        heng s, 2024, mathematics taner  b, 2024, sensors
        jiang b, 2024, chaos solitons fractals zhang y, 2024, appl sci
        wang y, 2024, biomim intell robotics wang h, 2024, int j intel rob appl
        layer bd, 2024, robotica korendiy v, 2024, vibroeng procedia
        meng y, 2024, adv mech eng zhang c, 2024, soft robotics
        harada k, 2024, int j control autom syst
        menga g, 2024, electronics (switzerland)
        wang m, 2024, proc acm int conf multimed in asia, mmasia
        zou c, 2024, int j humanoid rob zhang y, 2024, robotica
        yamano a, 2024, j rob mechatronics
        goldsmith ca, 2024, bioinspir biomimetics
        retnanto a, 2024, uist - proc annual acm symp user interface softw technol
        amine s, 2024, appl sci yessirkepov s, 2024, robotics
        dong c, 2024, ieee asme trans mechatron marquez-acosta e, 2024, robotics
        zhu z, 2024, biomim intell robotics
        hamzaçebi h, 2024, bioinspir biomimetics
        mohamed s, 2024, proc inst mech eng part c j mech eng sci
        yu y, 2024, thin-walled struct rao h, 2024, acm int conf proc ser
        safartoobi m, 2024, chaos solitons fractals
        ali s, 2024, multibody syst dyn wang h, 2024, int j intel rob appl-a
        qiao l, 2024, adv intell syst scaldaferri a, 2024, robotics
        liu x, 2024, int j neural syst luo a, 2024, ieee emded syst lett
        anjidani m, 2024, j control optim appl math
        li j, 2024, acm int conf proc ser dong c, 2024, expert sys appl
        cheng y, 2024, acs appl mater interfaces
        tovi e, 2024, int j non linear mech xue w, 2024, acm int conf proc ser
        de paula dt, 2024, robotica lee ch, 2024, int j semantic computing
        shen f, 2024, robotica katayama s, 2024, ifac-papersonline
        gautreau e, 2024, robotica zhang m, 2024, acm int conf proc ser
        khan ms, 2024, proc inst mech eng part c j mech eng sci
        muni mk, 2024, evol intelligence zhang y, 2024, biomimetics
        zhao j, 2024, adv mater igual j, 2024, sensors
        chen h, 2024, ieee asme trans mechatron
        chu r, 2024, acm int conf proc ser neumann o, 2024, appl sci
        yang y, 2024, soft robotics duhan s, 2024, int j math eng manag sci
        wu y, 2024, biomimetics kim k-h, 2024, int j control autom syst
        kakaei mm, 2024, rob autom syst hopkins ma, 2024, acm trans graphics
        wu y, 2024, actuators leung b, 2024, adv sci dan a, 2024, j mech robot
        gao z, 2024, expert sys appl
        kumar avvv, 2024, ieee int conf model, simul intell comput, mosicom - proc
        mustafa ma, 2024, conf proc ieee int conf syst man cybern
        jianyuan w, 2024, artif life rob liu x, 2024, integr comput aided eng
        badie n, 2024, bioinspir biomimetics peri s, 2024, proc mach learn res
        karakasis c, 2024, j dyn syst meas control trans asme
        sovukluk s, 2024, ieee robot autom
        bohlinger n, 2024, proc mach learn res
        torres agh, 2024, ieee urucon, urucon goto t, 2024, artif life rob
        shu x, 2024, caai trans intell technol
        vechet s, 2024, proc int conf mechatronics - mechatronika, me
        zhang r, 2024, j intell rob syst theor appl
        karim mf, 2024, proc int conf tools artif intell ictai
        cornejo j, 2024, bioinspir biomimetics itahashi n, 2024, appl sci
        robert m, 2024, ieee world forum internet things, wf-iot
        kelly j, 2024, asme int mech eng congress expos proc
        sun z, 2024, int j non linear mech
        zhao h, 2024, ieee asme trans mechatron tang j, 2024, mathematics
        pandit b, 2024, proc mach learn res
        chane-sane e, 2024, proc mach learn res
        pan q, 2024, proc - china autom congr, cac
        fazel r, 2024, appl math mech engl ed
        borovac b, 2024, int j humanoid rob
        sleiman j-p, 2024, proc mach learn res
        bingham k, 2024, asme int mech eng congress expos proc
        namgung j, 2024, j mech robot
        xiao s, 2024, proc ieee int conf unmanned syst, icus
        al-shuka hfn, 2024, intl j dyn cont
        huang j, 2024, int j control autom syst
        mizukami n, 2024, proc int asia-pacific reg conf istvs
        kim y, 2024, int conf ict convergence xie s, 2024, isa trans
        zhang y, 2024, j bionic eng hu h, 2024, proc mach learn res
        cooper b, 2024, asme int mech eng congress expos proc
        fazel r, 2024, comm nonlinear sci numer simul wang b, 2024, robotica
        li b, 2024, ieee trans control syst technol
        xin y, 2024, int j control autom syst
        yadav kp, 2024, proc inst mech eng part c j mech eng sci
        haomachai w, 2024, ieee robot autom doshi r, 2024, proc mach learn res
        huang y, 2024, biol cybern miyake t, 2024, ieee trans human mach syst
        zhang y, 2024, int conf intell robot autom control, irac
        kurva vk, 2024, indian control conf, icc - proc
        ishibashi m, 2024, artif life rob
        leonardi at, 2024, lect notes networks syst
        imai m, 2024, lect notes networks syst
        chen s, 2024, ieee int conf inf commun networks, icicn
        truax r, 2024, proc asme des eng tech conf
        garcia-barcos j, 2024, iber robot conf, robot
        wang j, 2024, ieee trans instrum meas
        graf n, 2024, lect notes networks syst
        kulkarni p, 2024, int conf adv comput, control, telecommun technol, act
        ono s, 2024, j rob mechatronics anh phn, 2024, oceans conf rec ieee
        yan c, 2024, ieee trans ind electron
        gerhard v, 2024, proc ieee ras embs int conf biomed rob biomechatronics, biorob
        leuthard s, 2024, lect notes networks syst
        lim s, 2024, int conf control, autom syst
        ren x, 2024, ieee trans med rob bion lu z, 2024, ieee trans ind inf
        bermudez g, 2024, lect notes networks syst
        tako t, 2024, ieee-ras int conf humanoid rob
        park hy, 2024, int conf control, autom syst
        csillag a, 2024, sisy - ieee int symp intell syst informatics, proc
        lima aph, 2024, proc lat american robot symp, lars
        ajmal m, 2024, int conf comput commun netw technol, icccnt
        xu t, 2024, proc ieee int conf cybern intell syst, cis
        yang p, 2024, soft robotics kumar j, 2024, int j intel rob appl
        li r, 2024, lect notes electr eng
        roux c, 2024, ieee-ras int conf humanoid rob li y, 2024, front robot ai
        tao m, 2024, icarm - ieee int conf adv robot mechatronics
        durikovic r, 2024, proc int conf new trends signal process, ntsp
        gonzalez leg, 2024, iber robot conf, robot yeldan a, 2024, j mech robot
        ma y, 2024, lect notes electr eng gong y, 2024, j field rob
        fu q, 2024, ieee asme trans mechatron liu z, 2024, adv funct mater
        kang j, 2024, ieee access liu m, 2024, int conf ind artif intell, iai
        huang x, 2024, int conf electron inf technol, eit
        potapov ia, 2024, conf proc - sci sch ''dyn complex networks their appl'', dcna
        rajendran v, 2024, lect notes networks syst
        tian z, 2024, procedia comput sci hodoshima r, 2024, j rob mechatronics
        patil g, 2024, proc ieee int conf power electron, intell control energy syst, icpeices
        cayetano-jimenez iu, 2024, ieee access xu y, 2024, ieee trans rob
        shamsah a, 2024, ieee trans autom sci eng
        cheng y, 2024, int conf artif intell, internet things cloud comput technol, aiotc
        sonea a, 2024, ieee access fu z, 2024, ieee asme trans mechatron
        oscco b, 2024, ismsit - int symp multidiscip stud innov technol, proc
        he z, 2024, ieee asme trans mechatron tian d, 2024, ieee trans ind inf
        navas e, 2024, lect notes networks syst
        wang y, 2024, ieee int conf mechatronics autom, icma
        rashmi d, 2024, lect notes mech eng
        matoušek s, 2024, proc conf stud eeict
        thibault w, 2024, lect notes networks syst
        bohara s, 2024, proc int jt conf neural networks
        kang w, 2024, ieee robot autom yoshida y, 2024, ieee robot autom
        gao y, 2024, proc - int symp intell robot syst, isoirs
        nagase j-y, 2024, ieee access nonoyama k, 2024, ieee robot autom
        chen s, 2024, proc - int symp intell robot syst, isoirs
        parlikar s, 2024, lect notes networks syst han j, 2024, ieee robot autom
        yamano j, 2024, mech mach sci
        he b, 2024, ieee int conf mechatronics autom, icma
        zou w, 2024, j field rob
        chen p, 2024, int conf artif intell electromechanical autom, aiea 2024
        song z, 2024, int conf mechatronics technol intell manuf, icmtim
        sándor b, 2024, lect notes comput sci geonea i, 2024, mech mach sci
        sun c, 2024, ieee robot autom sivak o, 2024, lect notes networks syst
        bisht rs, 2024, lect notes mech eng tazaki y, 2024, ieee robot autom
        zhao j, 2024, proc ieee int conf rob autom
        murooka m, 2024, ieee robot autom fu s, 2024, ieee robot autom
        pi c, 2024, ieee int conf mechatronics autom, icma
        dayanand v, 2024, icepe - int conf energy, power environ: towards indig energy utilization
        ren h, 2024, ieee access wang h, 2024, ieee robot autom
        ordoñez-apraez df, 2024, proc mach learn res
        nitulescu m, 2024, mech mach sci
        yang f, 2024, int conf robot, control autom, icrca
        yin b, 2024, int conf robot, control autom, icrca
        sivarajan aa, 2024, lect notes mech eng
        saputra aa, 2024, int electron symp: shap future: soc 50 beyond, ies - proceeding
        xiong j, 2024, ieee robot autom
        feng l, 2024, proc int jt conf neural networks
        xu y, 2024, ieee int conf mechatronics autom, icma
        fatahillah tz, 2024, int electron symp: shap future: soc 50 beyond, ies - proceeding
        pu l, 2024, ieee int conf mechatronics autom, icma
        geonea i, 2024, mech mach sci-a martinez-sanchez de, 2024, mech mach sci
        gupta a, 2024, proc conecct - ieee int conf electron, comput commun technol
        mousavi sm, 2024, jvc/j vib control
        perera klm, 2024, moratuwa eng res conf, mercon
        kang j, 2024, ieee robot autom
        otaki d, 2024, ieee int conf mechatronics autom, icma
        liu z, 2024, proc chin control decis conf, ccdc
        kabir m, 2024, ieee int conf electro inform technol
        memar kocheh bagh n, 2024, lect notes networks syst
        save om, 2024, ieee trans neural syst rehabil eng
        zhang y, 2024, ieee robot autom kim dh, 2024, ieee access
        qiu y, 2024, adv rob chanfreau l, 2024, lect notes networks syst
        hou y-y, 2024, iete j res singh b, 2024, ieee asme trans mechatron
        folgheraiter m, 2024, robotics
        lin y, 2024, proc int conf comput support coop work des, cscwd
        sakurai y, 2024, adv rob sankar km, 2024, lect notes networks syst
        lopes ms, 2024, lect notes networks syst
        muntean e, 2024, ieee int conf autom, qual test, robot, aqtr - proc
        allione f, 2024, ieee robot autom
        wang j, 2024, int conf electr eng, control robot, eecr
        reiche m, 2024, ieee robot autom liem wl, 2024, ieee access
        yamaguchi h, 2024, int conf control robot eng, iccre
        aydogmus o, 2024, ieee access yamano j, 2024, lect notes networks syst
        yu w-s, 2024, int conf syst sci eng, icsse
        cha j, 2024, springer proc adv robot
        liu x, 2024, proc - ieee conf artif intell, cai
        pace a, 2024, front robot ai liu z, 2024, mech mach theory
        wensing pm, 2024, ieee trans rob
        spiridonov a, 2024, proc ieee int conf rob autom
        tan w, 2024, ieee trans autom sci eng nguyen tt, 2024, ieee trans rob
        fu p, 2024, ieee j biomedical health informat
        xue c, 2024, int conf adv algorithms control eng, icaace
        li y, 2024, front robot ai-a zhang y, 2024, mech mach sci
        carvalho j, 2024, lect notes networks syst
        kobayashi t, 2024, lect notes comput sci
        grama ss, 2024, proc ieee int conf rob autom
        zhu z, 2024, ieee asme trans mechatron
        barasuol v, 2024, lect notes networks syst xu z, 2024, j bionic eng
        huang h, 2024, syscon - annu ieee int syst conf, proc
        fazel r, 2024, j braz soc mech sci eng
        pande d, 2024, lect notes networks syst amaike h, 2024, adv rob
        liow l, 2024, ieee trans rob lee h, 2024, lect notes networks syst
        tago y, 2024, ieee robot autom danilov v, 2024, lect notes networks syst
        albracht m, 2024, ieee robot autom
        antony b, 2024, smart innov syst technol
        le cleac'h s, 2024, ieee trans rob
        mohajer es, 2024, int conf artif intell robot, qicar
        al-maliki afh, 2023, intl j indust eng prod res zhang t, 2023, ocean eng
        singh b, 2023, auton robots gora s, 2023, j mech robot
        ding j, 2023, ieee asme trans mechatron kuo c-y, 2023, ieee robot autom
        han y, 2023, j zhejiang univ sci a lysø meb, 2023, ifac-papersonline
        gora s, 2023, acm int conf proc ser szabo r, 2023, mathematics
        zhang w, 2024, ieee int conf robot biom, robio
        russo l, 2024, int conf control robotics, iccr li z, 2023, int j rob res
        li j, 2023, j bionic eng ashtekar v, 2023, acm int conf proc ser
        ju i, 2023, ocean eng wu k, 2024, ieee int conf robot biom, robio
        khandelwal a, 2023, ieee robot autom wang h, 2023, intell robot
        mesesan g, 2023, ieee trans rob yang c, 2023, ieee robot autom
        mansor z, 2024, proc ieee conf syst, process control, icspc
        hao x, 2023, ind robot
        al mhdawi ak, 2024, proc - int conf dev esystems eng, dese
        choe j, 2023, ieee robot autom
        hairi yazdi mr, 2024, icrom - rsi int conf robot mechatronics
        liu y, 2023, j mech robot
        hu m, 2024, int conf robot, intell control artif intell, ricai
        xu s, 2023, ieee trans rob ali u, 2024, int conf robot autom ind, icrai
        ye l, 2023, nonlinear dyn kang p, 2023, robotica
        pham d-h, 2023, int j fuzzy syst larsen ad, 2023, adv theory simul
        zhu h, 2023, robotics mitchell al, 2023, ieee trans rob
        tiseo c, 2023, eng res exp şafak kk, 2023, biomimetics
        singh b, 2023, result eng yu h, 2023, control eng pract
        huan tt, 2023, j braz soc mech sci eng
        ranjbaran f, 2024, icrom - rsi int conf robot mechatronics
        alemayoh tt, 2023, sensors chen h, 2023, ieee trans rob
        fu q, 2023, bioinspir biomimetics kim d, 2023, ieee robot autom
        lanh lak, 2023, int j intell unmanned syst
        bonsignorio f, 2023, ifac-papersonline thennakoon m, 2024, iecon proc
        dong s, 2024, int conf front technol inf comput, icftic
        sharma kk, 2024, ieee pune sect int conf, punecon
        chen g, 2023, j field rob er gd, 2023, bioinspir biomimetics
        humphreys j, 2023, ieee robot autom dan a, 2023, acm int conf proc ser
        thakur d, 2023, j intelligent fuzzy syst okada y, 2023, intl j dyn cont
        ha j, 2023, ieee trans rob zhu z, 2023, auton robots
        koochakianfard o, 2024, icrom - rsi int conf robot mechatronics
        zhou y, 2023, chaos solitons fractals
        ortega-palacios ma, 2023, j automation, mob robot intell syst
        song z, 2023, nonlinear dyn xie y, 2023, robotica
        semwal vb, 2023, acm int conf proc ser bi j, 2024, j bionic eng
        miwa s, 2023, artif life rob zhu z, 2023, ieee robot autom
        wang k, 2023, mechatronics semwal vb, 2023, multimedia tools appl
        sun p, 2023, biomimetics huang z, 2023, rob autom syst
        huang c, 2023, ieee trans pattern anal mach intell
        yaqoob b, 2023, j r soc interface li j, 2023, ieee sensors j
        tang zy, 2023, teh vjesn
        li f, 2023, int conf electr, mech comput eng, icemce
        bhardwaj g, 2023, int j control autom syst huang t, 2023, manuf technol
        soni r, 2023, ieee int conf intell rob syst
        lv x, 2023, proc - china autom congr, cac
        al-shuka hfn, 2023, mech solids schwarke c, 2023, proc mach learn res
        pan z, 2023, acta mech sin luo m, 2023, proc - china autom congr, cac
        zhou g, 2023, nonlinear dyn homchanthanakul j, 2023, ieee robot autom
        wang z, 2023, biomimetics
        wei z, 2023, int conf mechatronics, robot autom, icmra
        wu y, 2023, proc inst mech eng part c j mech eng sci
        calzolari d, 2023, ieee robot autom zhou q, 2023, adv sci
        jaberi miandoab m, 2023, nonlinear dyn
        zhou g, 2023, proc r soc a math phys eng sci
        cai x-h, 2023, int conf front technol inf comput, icftic
        talley c, 2023, asme int mech eng congress expos proc
        iwatani y, 2023, annu conf soc instrum control eng, sice
        koseki s, 2023, front neurorobotics lin c-m, 2023, asian j control
        das r, 2023, int j humanoid rob
        nekomoto r, 2023, j adv comput intell intelligent informatics
        li j, 2023, appl intell
        han c, 2023, ieee int conf data sci comput appl, icdsca
        parra camacho lc, 2023, ieee lat am conf comput intell, la-cci
        qiu y, 2023, annu conf soc instrum control eng, sice
        duhan s, 2023, procedia comput sci rengifo c, 2023, intl j dyn cont
        yang b, 2023, intl j syst assur eng manage chen b, 2023, micromachines
        khan ms, 2023, acta polytech hung
        rahman k, 2023, asme int mech eng congress expos proc
        chauhan a, 2023, adv transdiscipl eng park b, 2023, rob autom syst
        thakkar am, 2023, procedia comput sci
        zyhowski wp, 2023, front neurorobotics
        wu z, 2023, proc - china autom congr, cac han l, 2023, robotica
        liu j, 2023, robotica
        wei z, 2023, int acad exch conf sci technol innov, iaecst
        xu z, 2023, biomimetics
        mitobe k, 2023, ieee int symp robot sensors environ, rose - proc
        gao z, 2023, biomimetics bhardwaj g, 2023, appl intell
        guetta o, 2023, bioinspir biomimetics xie s, 2023, isa trans
        xia q, 2023, int conf control, robot cybern, crc
        cho b, 2023, ieee asme trans mechatron
        guo y, 2023, proc chin control decis conf, ccdc
        shirwatkar a, 2023, proc ieee int conf rob autom
        liu x, 2023, integr comput aided eng
        su m, 2023, chinese control conf, ccc auzan m, 2023, j robot control
        ozcinar ec, 2023, proc - ieee int conf mechatronics, icm
        luo g, 2023, lect notes comput sci
        liang d, 2023, chinese control conf, ccc
        xiang x, 2023, ieee int conf mechatronics autom, icma
        li j, 2023, lect notes comput sci zhang j, 2023, lect notes mech eng
        wang h, 2023, proc spie int soc opt eng
        goldsmith ca, 2023, lect notes comput sci
        tucker m, 2023, ieee control syst lett haldar ai, 2023, mater today proc
        yang z, 2023, proc - int conf commun, comput artif intell, cccai
        ye l, 2023, lect notes comput sci
        added e, 2023, int multi-conf syst, signals devices, ssd
        added e, 2023, proc ieee int conf adv syst emerg technol, ic_aset
        zhiyong j, 2023, chinese control conf, ccc
        chen x, 2023, proc - int conf front robot softw eng, frse
        tang l, 2023, lect notes comput sci
        fu y, 2023, ieee int conf mechatronics autom, icma
        ulurrasyadi f, 2023, ies - int electron symp: unlocking potential immersive technol live better life, proceeding
        yadav kp, 2023, ieee annu flagship india counc int subsections conf: comput intell learn syst, indiscon
        shu y, 2023, int j comput sci math
        tadic t, 2023, ict electron conv, mipro - proc
        pelit mm, 2023, ieee asme int conf adv intellig mechatron aim
        torres-figueroa j, 2023, ieee access zhang y, 2023, ieee access
        folgheraiter m, 2023, int conf autom, robot appl, icara
        bestmann m, 2023, lect notes comput sci luo q, 2023, int j humanoid rob
        wang z, 2023, ieee int conf cyborg bionic syst, cbs
        tsai s-h, 2023, lect notes electr eng djamari dw, 2023, asean eng j
        xiao y, 2023, lect notes comput sci
        chun y, 2023, ieee/sice int symp syst integr, sii
        liu y, 2023, lect notes comput sci
        torres d, 2023, proc asme des eng tech conf
        hua q, 2023, lect notes comput sci
        qi b, 2023, ieee int conf mechatronics autom, icma
        tang j, 2023, lect notes comput sci gao c, 2023, lect notes comput sci
        motegi m, 2023, commun comput info sci
        wang x, 2023, int symp auton syst, isas
        singh b, 2023, int j model ident control chen b-s, 2023, ieee access
        parra-moreno j, 2023, proc ieee colomb conf autom control, ccac
        ozkaynak b, 2023, ieee int conf ind informatics (indin)
        sharma kk, 2023, proc int conf signal process integr networks, spin
        meng y, 2023, proc mach learn res
        dafni rose j, 2023, int conf inven comput technol, icict - proc
        yang x, 2023, lecture notes data eng commun tech
        singh b, 2023, ieee annu flagship india counc int subsections conf: comput intell learn syst, indiscon
        zhao p, 2023, lect notes comput sci shi f, 2023, springer proc adv robot
        li c, 2023, front neurorobotics
        castillo-hernandez ig, 2023, mech mach sci
        navaneethakrishnan m, 2023, vitecon - ieee int conf vis towards emerg trends commun netw technol, proc
        murali a, 2023, lect notes electr eng
        tian y, 2023, chinese control conf, ccc
        kwan a, 2023, lect notes comput sci zhu y, 2023, lect notes comput sci
        li j, 2023, ieee control syst lett jiang h, 2023, lect notes comput sci
        yu j, 2023, int conf inf, cybern, comput soc syst, iccss
        li w, 2023, proc ieee int conf rob autom han y-h, 2022, rob autom syst
        peng wz, 2022, mech mach theory gkliva r, 2022, ieee robot autom
        added e, 2022, chaos theory appl astolfi a, 2022, ieee trans rob
        yang l, 2022, front neurorobotics sahu c, 2022, soft comput
        wu q, 2022, front robot ai xu h, 2022, iet cyber-syst robot
        zhu y, 2022, ieee trans cybern wang x, 2022, mech mach theory
        sharma b, 2022, ieee trans med rob bion
        ding j, 2022, ieee asme trans mechatron
        liu y, 2022, acm int conf proc ser luo g, 2022, micromachines
        abedzadeh maafi r, 2022, j braz soc mech sci eng
        narkhede ks, 2022, ieee robot autom
        parappagoudar d, 2022, proc inst mech eng part c j mech eng sci
        rodwell c, 2022, nonlinear dyn huang q, 2022, ieee asme trans mechatron
        mcgreavy c, 2022, ieee asme trans mechatron yan c, 2022, artif life rob
        navaneeth mg, 2022, arab j sci eng li j, 2022, auton robots
        xie z, 2022, iran j sci technol trans mech eng
        li h, 2022, mech mach theory selim e, 2022, robotica
        ada se, 2022, robotica ahmad h, 2022, robotica
        yadav kp, 2022, intl j dyn cont virgala i, 2022, appl sci
        zhang c, 2022, biomim intell robotics aller f, 2022, front robot ai
        acosta b, 2022, ieee robot autom jain r, 2022, expert syst
        virgala i, 2022, mm sci j yamamoto k, 2022, rob autom syst
        luo g, 2022, j intell rob syst theor appl yu c, 2022, ieee robot autom
        kojima m, 2022, front robot ai bong jh, 2022, biomimetics
        tidd b, 2022, ieee robot autom
        tao c, 2022, ieee trans circuits syst express briefs
        safartoobi m, 2022, nonlinear dyn khan at, 2022, j comput sci
        fu q, 2022, bioinspir biomimetics
        chairez i, 2022, proc inst mech eng part k j multi-body dyn
        sim y, 2022, ieee robot autom shun g, 2022, j mech robot
        karagoz ok, 2022, bioinspir biomimetics
        li y, 2023, lect notes electr eng chand p, 2022, ieee robot autom
        dong h, 2022, soft robotics ahn d, 2022, ieee trans ind electron
        zhang r, 2022, ieee asme trans mechatron
        chen g, 2022, biomech model mechanobiology lee y, 2022, ieee trans rob
        sedghi f, 2023, int j control cui z, 2022, micromachines
        hammoud b, 2022, multibody syst dyn gu s, 2022, autom constr
        rincon-martinez k, 2022, appl sci
        çatalbaş b, 2022, j intell rob syst theor appl
        li l, 2022, iran j sci technol trans mech eng
        guadarrama-olvera jr, 2022, ieee robot autom
        li j, 2022, eng appl artif intell prieto av, 2022, ieee robot autom
        hou l, 2022, mach selim e, 2022, int j humanoid rob
        lower j, 2022, ifac-papersonline wu w, 2022, micromachines
        liao f, 2022, nonlinear dyn yang y, 2022, biomimetics
        melo dc, 2022, j intell rob syst theor appl cho j, 2022, appl sci
        xiong x, 2022, ieee trans rob park hy, 2022, ieee trans ind inf
        rincon k, 2022, ieee trans syst man cybern syst
        chen b, 2022, biomimetics bellegarda g, 2022, ieee robot autom
        fevre m, 2022, auton robots jing c, 2022, mobile networks appl
        li j, 2022, j intell rob syst theor appl
        yao d, 2022, ieee trans ind electron
        chung r-l, 2022, electronics (switzerland) chang c-w, 2022, process
        christie md, 2022, smart mater struct luo q, 2022, iet cyber-syst robot
        shao d, 2022, bioinspir biomimetics yoon s-j, 2022, sensors
        shri ishwaryaa sv, 2022, asme int mech eng congress expos proc
        li z, 2022, iciea - proc ieee conf ind electron appl
        yang p, 2022, ieee int conf intell rob syst
        mihalec m, 2022, ifac-papersonline
        weihmann t, 2022, front bioeng biotechnol chen t, 2022, iet conf proc
        fischman ekman simões i, 2022, j braz soc mech sci eng
        du r, 2022, actuators
        peng k, 2022, ieee int conf robot biomimetics, robio
        li w, 2022, int conf robot autom eng, icrae
        ranjan r, 2022, indicon - ieee india counc int conf
        tsai c-c, 2022, int autom control conf, cacs
        ghadi y, 2022, proc - int arab conf inf technol, acit
        xing b, 2022, proc asia-pacific reg conf istvs
        stuttaford-fowler a, 2022, icsse - int conf syst sci eng
        frizza i, 2022, int j humanoid rob
        bayat n, 2022, natl int iranian conf biomed eng, icbme
        wang s, 2022, int conf mech electron eng, icmee
        lee ch, 2022, proc - ieee int conf robot comput irc
        cinto f, 2022, ieee bienn congr argentina, argencon
        bonafede g, 2022, int j mech control
        iwatani y, 2022, sice j control meassyst integr kim n, 2022, robotica
        rodriguez idj, 2022, proc mach learn res
        guliyev z, 2022, ieee int conf appl inf commun technol, aict - proc
        yoo j, 2022, int j precis eng manuf liu h, 2022, procedia comput sci
        huynh t-t, 2022, ieee trans syst man cybern syst
        tricomi e, 2022, ieee robot autom singh b, 2022, j bionic eng
        krishna l, 2022, ieee robot autom
        yin z, 2022, proc ieee int conf ind technol
        brahmi b, 2022, intl j dyn cont chen j, 2022, electron res arch
        mitin i, 2022, lect notes comput sci park c, 2022, sensors
        nguyen td, 2022, proc int conf green technol sustain dev, gtsd
        nie d, 2022, procedia comput sci khan ms, 2022, commun comput info sci
        chen d, 2022, ieee robot autom kalamain n, 2022, j eng sci technol rev
        huan tt, 2022, proc int conf green technol sustain dev, gtsd
        kumar j, 2022, robotica
        umurzakov t, 2022, int conf robot autom eng, icrae
        shu y, 2022, int j wireless mobile comput
        takeda k, 2022, int j adv rob syst hobon m, 2022, robotica
        duran-hernandez j, 2022, int conf control, mechatronics autom, iccma
        rosa n, 2022, ieee trans rob
        yao d, 2022, icnsc - proc ieee int conf netw, sens control: auton intell syst
        che j, 2022, actuators seeja g, 2022, ieee access
        zhang l, 2022, proc - int conf autom, control robot eng cacre
        singh b, 2022, ieee ias glob conf emerg technol, globconet
        maiti tk, 2022, int j rob autom kumar j, 2021, int j humanoid rob
        zhao y, 2022, int conf intell comput signal process, icsp
        kim s-h, 2021, j intell rob syst theor appl
        gawhale k, 2022, commun comput info sci chae h, 2021, front robot ai
        naya-varela m, 2022, proc int jt conf neural networks
        dong t, 2022, proc spie int soc opt eng
        patel s, 2022, ieee delhi sect conf, delcon
        rodman ch, 2021, ifac-papersonline
        ahmadi m, 2022, ieee control syst lett
        lin p-c, 2022, ieee eurasian conf educ innov, ecei
        kundu d, 2022, lect notes mech eng cao g, 2022, lect notes electr eng
        rincon k, 2022, int conf control, decis inf technol, codit
        ozkan-aydin y, 2022, bioinspir biomimetics
        chang q, 2021, electronics (switzerland)
        added e, 2022, proc int conf adv syst emergent technol, ic_aset
        kasaei m, 2021, rob autom syst huan tt, 2022, lect notes mech eng
        yan c, 2022, lect notes networks syst wang h, 2022, int j rob autom
        li x, 2022, ieee int conf mechatronics autom, icma
        wang k, 2022, lect notes networks syst zhu l, 2021, j mech phys solids
        parra ricaurte ea, 2022, lect notes electr eng
        zheng y, 2022, ieee int conf power, intell comput syst, icpics
        nigido g, 2022, mech mach sci almeida l, 2021, ieee sensors j
        kumar j, 2021, int j intel rob appl leng j, 2022, ieee access
        chen b-s, 2022, ieee access mihalec m, 2021, ifac-papersonline
        chen t-y, 2022, adv rob arpenti p, 2022, int j control autom syst
        ma h, 2022, proc int jt conf neural networks
        cherfouh k, 2022, ifac-papersonline nguyen vd, 2022, math biosci eng
        loschi a, 2022, mech mach sci
        wu q, 2022, ieee int conf mechatronics autom, icma
        enomoto k, 2022, ieee int conf soft robot, robosoft
        aeini a, 2022, int conf control, instrum autom, iccia
        semwal vb, 2021, comput wu t, 2021, j intell rob syst theor appl
        kamidi vr, 2021, ieee control syst lett
        sugihara t, 2022, lect notes networks syst
        zhang w, 2022, peerj comput sci fawcett rt, 2022, ieee control syst lett
        yang l, 2022, int conf sustain comput data commun syst, icscds - proc
        yang c, 2022, ieee sensors j reddy kb, 2022, lect notes mech eng
        berninger tfc, 2022, conf proc soc exp mech ser
        ranjan r, 2022, int conf emerg front electr electron technol, icefeet
        wang s, 2022, lect notes comput sci singh d, 2022, lect notes mech eng
        weng y, 2022, lect notes comput sci zhou z, 2022, lect notes comput sci
        zhou l, 2021, j bionic eng diaz k, 2021, bioinspir biomimetics
        ma w-l, 2021, ieee control syst lett or y, 2021, ieee trans rob
        lee yh, 2021, j intell rob syst theor appl yuan h, 2021, asian j control
        guo y, 2021, ieee robot autom kim t, 2021, int j control autom syst
        ke w, 2021, concurr comput pract exper
        navaneeth mg, 2021, acm int conf proc ser
        liao f, 2021, chinese control conf, ccc luo a, 2021, ieee sensors j
        mahkam n, 2021, ieee int conf soft robot, robosoft
        added e, 2021, ieee int multi-conf syst, signals devices, ssd
        chen b-s, 2021, ieee trans control netw syst
        raj m, 2021, j circuits syst comput yang l, 2021, appl sci
        green k, 2021, ieee robot autom ji q, 2021, sensors
        yu h, 2021, ieee trans rob
        jagannath v, 2021, proc int conf comput sustain glob dev, indiacom
        che j, 2021, acm int conf proc ser ding j, 2021, robotica
        rossini l, 2021, front robot ai
        huan tt, 2021, proc int conf syst sci eng, icsse
        pradhan s, 2021, int j inf technol lee yh, 2021, j mech robot
        farid y, 2021, rob autom syst vasileiou c, 2021, mech mach theory
        khan at, 2021, ieee trans circuits syst express briefs
        hu y, 2021, int conf control, autom robot, iccar
        zhu h, 2021, ieee asme trans mechatron
        hirotomi t, 2021, j rob mechatronics
        yusof kh, 2021, ieee control syst grad res colloq, icsgrc - proc
        catalano mg, 2021, ieee robot autom sun y, 2021, ieee robot autom
        ding h, 2021, struct mutltidiscip opt
        nguyen k-n-k, 2021, ieee robot autom ma w-l, 2021, ieee robot autom
        daneshmand e, 2021, ieee robot autom znegui w, 2021, appl math model
        zhang z, 2021, appl math model li l, 2021, appl sci
        sihite e, 2021, ieee asme int conf adv intellig mechatron aim
        kim h-s, 2021, bioinspir biomimetics kasaei m, 2021, sn appl sci
        pelit mm, 2021, ieee asme int conf adv intellig mechatron aim
        li h, 2021, ieee robot autom heins s, 2021, ieee robot autom
        sobirin m, 2021, proc - ieee int conf ind 40, artif intell, commun technol, iaict
        chen t, 2021, rob autom syst suzuki s, 2021, front neurorobotics
        beigzadeh b, 2021, int j humanoid rob
        gora s, 2021, acm int conf proc ser
        mori k, 2021, proc - ieee conf virtual real 3d user interfaces abstr workshops, vrw
        peng wz, 2021, j mech robot fang d, 2021, acm int conf proc ser
        malhotra a, 2021, proc int conf comput sustain glob dev, indiacom
        wu z, 2021, conf digest - int conf secur, pattern anal, cybern, spac
        singh b, 2021, proc - int conf smart technol commun robot, stcr
        ahn j, 2021, front robot ai
        rincón-martínez k, 2021, proc inst mech eng part i j syst control eng
        ren h, 2021, robotica venancio mm, 2021, ieee asme trans mechatron
        liu c, 2021, ieee trans syst man cybern syst xie z, 2021, rob autom syst
        aoi s, 2021, front robot ai safartoobi m, 2021, mech mach theory
        spyrakos-papastavridis e, 2021, j mech robot
        chang h, 2021, bioinspir biomimetics lisitano d, 2021, appl sci
        added e, 2021, ieee int multi-conf syst, signals devices, ssd-a
        ko t, 2021, int j humanoid rob
        vedadi a, 2021, rsi int conf robot mechatronics, icrom
        gao z, 2021, proc ieee int conf unmanned syst, icus
        coelho j, 2021, proc - int conf comput autom, compauto
        orozco-soto sm, 2021, proc robot mex congr, comrob li l, 2021, sensors
        muscolo gg, 2021, int j humanoid rob liu c, 2021, appl sci
        csomay-shanklin n, 2021, proc mach learn res
        zhang c, 2021, proc spie int soc opt eng
        thalman cm, 2021, ieee int conf intell rob syst
        kalamian n, 2021, int conf control, instrum autom, iccia
        burzynski p, 2021, bull pol acad sci tech sci
        wu y-c, 2021, int autom control conf, cacs
        chen g, 2021, proceeding - china autom congr, cac
        chevallereau c, 2021, mech mach theory
        ren l, 2021, ieee int conf robot biomimetics, robio
        ji q, 2021, front bioeng biotechnol
        kong b, 2021, proc - int conf netw, commun inf technol, netcit
        gao c, 2021, int conf mechatronics robot eng, icmre
        yu j, 2021, lect notes comput sci
        fierro je, 2021, proc robot mex congr, comrob
        gao j, 2021, ieee asme trans mechatron
        vatavuk i, 2021, proc ieee int conf rob autom
        williams ds, 2021, j mech robot menga g, 2021, appl sci
        agbo do, 2021, indian j eng hou l, 2021, appl sci
        liang j, 2021, proceeding - china autom congr, cac
        dadashzadeh b, 2021, int j model ident control
        yu j, 2021, ieee int conf robot biomimetics, robio-a
        singh b, 2021, proc ieee int conf disruptive technol multi-disciplin res appl, centcon
        ramanathan kc, 2021, int j rob autom
        singh b, 2021, ieee uttar pradesh sect int conf electr, electron comput eng, upcon
        lopez a, 2021, proc ieee colomb conf autom control, ccac
        li t-hs, 2021, ieee sensors j wu y, 2021, peerj comput sci
        naya-varela m, 2021, lect notes comput sci
        sharbafi ma, 2021, ieee asme trans mechatron
        bloesch m, 2021, proc mach learn res
        zhang j, 2021, proc int offshore polar eng conf
        bian y, 2021, j mech sci technol
        quintanilla j, 2021, proc robot mex congr, comrob
        alberto mgc, 2021, coniin - int eng congr
        added e, 2021, ifac-papersonline
        stefanini c, 2021, artif life conf proc alife
        lan c-w, 2021, ispacs - int symp intell signal process commun syst: 5g dream real, proceeding
        prasanna venkatesan ks, 2021, ieee/sice int symp syst integr, sii
        leng x, 2021, j intelligent fuzzy syst
        li l, 2021, j intelligent fuzzy syst
        oguzhan ahan a, 2021, ismsit - int symp multidiscip stud innov technol, proc
        farhat m, 2021, int j model ident control
        fu q, 2021, ieee int conf robot biomimetics, robio
        anzai a, 2021, int j mechatronics autom
        xie c, 2021, commun comput info sci
        azimi v, 2021, ieee trans syst man cybern syst
        leal pbc, 2021, j r soc interface
        du r, 2021, ieee int conf robot biomimetics, robio
        chauhan r, 2021, proc - oits int conf inf technol, ocit
        park b, 2020, int conf control, autom syst
        added e, 2020, proc int conf adv syst emergent technol, ic_aset
        kakaei mm, 2020, robotica
        znegui w, 2020, int conf eng technol appl, iiceta
        wang k, 2021, j bionic eng
        amos m, 2020, ieee symp ser comput intell, ssci ji q, 2021, adv mech eng
        sánchez-delgado ca, 2020, j mech robot
        sun z, 2020, j intell rob syst theor appl
        zhiqiang l, 2021, int j adv rob syst wang x, 2020, biomimetics
        venkiteswaran vk, 2020, extrem mech lett yamamoto t, 2021, adv rob
        gritli h, 2021, int j autom control
        lele as, 2020, ieee j emerg sel top circuits syst
        nandula akr, 2021, lect notes mech eng
        kume s, 2021, commun comput info sci zoccali a, 2021, mech mach sci
        tian j, 2020, int j humanoid rob
        injoon m, 2020, int conf control, autom syst
        akkawutvanich c, 2020, rob autom syst
        akbari hamed k, 2020, ieee trans control syst technol
        leng x, 2020, phys commun
        tzeng ej, 2021, proc int conf eur soc precis eng nanotechnol, euspen
        bhounsule pa, 2020, robotics kim y, 2021, ieee access
        varma n, 2021, lect notes mech eng zhang j, 2021, assem autom
        lu y, 2020, int conf control robot, iccr surovik d, 2021, int j rob res
        added e, 2020, int conf eng technol appl, iiceta
        yamamoto t, 2020, adv rob mohamed sa, 2021, int j adv rob syst
        bazargan-lari y, 2020, iran j sci technol trans mech eng
        zhou y, 2020, iecon proc
        nguyen xt, 2020, int conf adv mechatronic sys, icamechs
        khan ui, 2020, ieee trans control syst technol
        qin m, 2020, ieee int conf mechatronics autom, icma
        shibata h, 2020, artif life rob raza f, 2021, ieee access
        ren h, 2021, meas control giardina f, 2021, j r soc interface
        abideen zu, 2020, int conf autom, control robot, icacr
        yamamoto k, 2020, adv rob ganguly a, 2021, smart innov syst technol
        hao m, 2020, j mech robot jana s, 2021, lect notes mech eng
        singh r, 2021, smart innov syst technol kimura k, 2020, robomech j
        huan tt, 2021, adv intell sys comput
        lee h-j, 2021, int j precis eng manuf
        saputra aa, 2020, ieee int conf intell rob syst
        aithal cn, 2021, lect notes electr eng hashimoto k, 2020, adv rob
        murotani k, 2020, adv rob
        nansai s, 2020, conf proc ieee int conf syst man cybern
        singh r, 2020, ieee int conf ind inf syst, iciis - proc
        sheng y, 2021, proc international conference artificial life robot
        duan w, 2020, proc ieee conf ind electron appl, iciea
        znegui w, 2020, proc int conf adv syst emergent technol, ic_aset
        znegui w, 2020, proc int multi-con syst, signals devices, ssd
        znegui w, 2020, proc int multi-con syst, signals devices, ssd-a
        jing c, 2020, j coast res dadashzadeh b, 2020, int appl mech
        li z, 2020, ieee trans ind inf wang m, 2020, j mech robot
        chiang s-y, 2020, adv mech eng zhang c, 2020, j phys conf ser
        sutyasadi p, 2020, ind robot
        park g, 2020, ieee int conf emerging technol factory autom, etfa
        moreira l, 2020, ieee int conf auton robot syst compet, icarsc
        chang l, 2020, phys commun
        lele as, 2020, proc - ieee int conf artif intell circuits syst, aicas
        okamoto k, 2020, bioinspir biomimetics
        kasaei m, 2020, ieee int conf auton robot syst compet, icarsc
        corral e, 2020, appl sci jeong h, 2020, mechatronics
        znegui w, 2020, nonlinear dyn honert ec, 2020, hum mov sci
        cui j, 2020, adv mech eng azayev t, 2020, j intell rob syst theor appl
        kaln mai, 2020, ieee robot autom
        negri gh, 2020, optim control appl methods kolathaya s, 2020, automatica
        liu y, 2020, j mech robot ahn j, 2020, ieee robot autom
        wang b, 2020, int j pattern recognit artif intell
        mochiyama s, 2020, nonlinear dyn yang c, 2020, ieee robot autom
        chen g, 2020, proc chin control decis conf, ccdc
        bayon c, 2020, ieee trans neural syst rehabil eng
        schütz s, 2020, bioinspir biomimetics hao q, 2020, sensors
        wu c, 2020, j phys d abu-dakka fj, 2020, sensors
        veer s, 2020, ieee trans autom control shi q, 2020, ind robot
        xi a, 2020, sensors dadashzadeh b, 2020, robotica
        aljalbout e, 2020, neural process letters
        russell f, 2020, ieee trans biomed eng khadiv m, 2020, ieee trans rob
        horn jc, 2020, ieee robot autom yao d, 2020, trans inst meas control
        yin h, 2020, ieee trans cybern ahn dh, 2020, int j precis eng manuf
        wang s, 2020, chinese control conf, ccc
        kitamura r, 2020, annu conf soc instrum control eng japan, sice
        shi x, 2020, sensors zhao d, 2020, bioinspir biomimetics
        ryu k, 2020, int j precis eng manuf
        liu j, 2020, proc ieee int conf rob autom
        sharbafi ma, 2020, ieee asme trans mechatron jing c, 2020, j coast res-a
        hooks j, 2020, ieee robot autom kumar s, 2020, ieee robot autom
        schallheim i, 2020, bioinspir biomimetics
        st pierre r, 2020, bioinspir biomimetics
        wang h, 2020, adv control appl eng ind syst
        fisher c, 2020, front mech eng zhang j, 2020, appl sci
        liu c, 2020, robotica kim d, 2020, int j rob res
        hobart cg, 2020, ieee trans rob dear t, 2020, int j rob res
        wang m, 2020, int j adv rob syst liu c, 2020, j bionic eng
        wang h, 2020, comm nonlinear sci numer simul
        pi m, 2020, ieee trans ind electron
        rogelio guadarrama olvera j, 2020, int j humanoid rob
        savin s, 2020, smart innov syst technol dini n, 2020, mech mach theory
        hafner r, 2020, proc mach learn res
        smith bjh, 2020, bioinspir biomimetics
        znegui w, 2020, chaos solitons fractals
        morisawa m, 2020, int j humanoid rob tang c, 2020, adv eng mater
        dangol p, 2020, ifac-papersonline xi a, 2020, ieee access
        romualdi g, 2020, int j humanoid rob
        mandava rk, 2020, neural comput appl
        surovik d, 2020, proc mach learn res wong c-c, 2020, ieee access
        anh hph, 2020, int j comput intell syst
        gumeniuk va, 2020, adv intell sys comput
        bhattacharya s, 2020, ieee access
        goomer m, 2020, natl conf mach mech, nacomm
        huzaifa u, 2020, int j soc rob tacué j, 2020, int j adv rob syst
        panwar r, 2020, neural comput appl kumagai i, 2020, int j humanoid rob
        yeolekar bm, 2020, structural integr vek konstr menga g, 2019, robotics
        nacusse m, 2020, ifac-papersonline
        yilmaz s, 2020, intl j adv comput sci appl
        vonwirth p, 2020, mech mach sci chen t, 2020, auton robots
        pretorius cj, 2019, j intell rob syst theor appl
        trono g, 2020, front mech eng zhao y, 2020, int j intel rob appl
        pransky j, 2020, ind robot
        kumar m, 2020, int conf emerg smart comput informatics, esci
        peng h, 2020, j intell mater syst struct
        eldirdiry o, 2020, simul model pract theory
        ariyanto m, 2019, int semin res inf technol intell syst, isriti
        raj m, 2020, int j adv sci technol sygulla f, 2020, int j adv rob syst
        chignoli m, 2020, ieee access popov d, 2020, lect notes electr eng
        juang l-h, 2020, artif intell rev maiorino a, 2020, front mech eng
        katayama s, 2020, int j robust nonlinear control
        wu l-f, 2020, ieee access lei t, 2020, lect notes comput sci
        mattausch hj, 2020, int symp devices, circuits syst, isdcs - proc
        rouse c, 2020, asme dyn syst control conf, dscc
        miyata a, 2020, ieee robot autom xie h, 2020, j mech sci technol
        kim i-s, 2019, j intell rob syst theor appl
        sayari ma, 2020, lect notes mech eng ikizoǧlu s, 2020, int j rob autom
        peng wz, 2020, proc asme des eng tech conf
        li z, 2020, ieee trans ind electron khusainov r, 2020, ifac-papersonline
        makarenkov o, 2020, proc r soc a math phys eng sci
        mizoguchi n, 2019, acm int conf proc ser
        lin z, 2020, technol health care phan lt, 2020, intelligent serv rob
        vonwirth p, 2020, smart innov syst technol
        ye w, 2020, lect notes comput sci liu c, 2020, ieee access
        rohith kk, 2020, lect notes mech eng sun t, 2020, front neurorobotics
        hui s, 2020, ifac-papersonline
        zhang j, 2019, proc ieee adv inf technol, electron autom control conf, iaeac
        guo f, 2020, ind robot
        yadav gk, 2020, int conf signal process integr networks, spin
        garcía j, 2020, eng appl artif intell
        ali ss, 2020, int j model ident control kumar pb, 2020, sci iran
        lee j, 2020, ieee access dangol p, 2020, proc spie int soc opt eng
        nakada k, 2020, ieice trans fund electron commun comput sci
        nguyen v-t, 2020, int j mech eng robot res jing c, 2020, open phys
        akashi n, 2019, mhs - int symp micro-nanomechatronics hum sci
        singh r, 2019, j braz soc mech sci eng
        bi q, 2019, ieee int conf robot biomimetics, robio
        joe h-m, 2019, sensors jenelten f, 2019, ieee robot autom
        walker k, 2019, int j adv rob syst folgheraiter m, 2019, rob autom syst
        jamisola rs, 2019, proc ieee int conf cybern intell syst robot, autom mechatronics, cis ram
        fisher c, 2019, ieee robot autom
        zhang c, 2019, ieee int conf robot biomimetics, robio
        ruilong d, 2019, ieee int conf robot biomimetics, robio
        raoufi m, 2019, icrom - int conf robot mechatronics
        nunuparov a, 2019, arch appl mech wang r, 2019, ieee trans ind electron
        hazrati b, 2019, intl j dyn cont mirza nm, 2019, tem j
        sari wp, 2019, ies - int electron symp: role techno-intell creat open energy syst towards energy democr, proc
        rebula jr, 2019, ieee robot autom luo q, 2019, int j humanoid rob
        li q, 2019, ieee trans autom sci eng villa na, 2019, ieee robot autom
        missura m, 2019, int j humanoid rob hosseinmemar a, 2019, appl intell
        yan c, 2019, ieee int conf robot biomimetics, robio
        zhang z, 2019, ieee int conf integr circuits, technol appl, icta - proc
        aldair aa, 2019, irn j sci technol trans electri eng
        chen l, 2019, ieee int conf robot biomimetics, robio
        manchester z, 2019, int j rob res tun tt, 2019, autom constr
        ortiz a, 2019, int conf electr eng, comput sci autom control, cce
        razavi h, 2019, int j rob res he b, 2019, auton robots
        khusainov r, 2019, sch dyn complex networks appl intellect robot, dcnair
        han b, 2019, j beijing inst technol engl ed
        lin c-m, 2019, int j fuzzy syst
        zhu j, 2019, ieee int conf robot biomimetics, robio
        luo x, 2019, ieee int conf robot biomimetics, robio
        leottau dl, 2019, eng appl artif intell
        xiang h, 2019, ieee int conf robot biomimetics, robio
        sayari ma, 2019, j mech sci technol menga g, 2019, robotics-a
        lin j, 2019, ieee int conf robot biomimetics, robio
        jiang c, 2019, proc ieee workshop adv rob soc impacts, arso
        huan tt, 2019, proc - int symp electr electron eng, isee
        ansari aa, 2019, int conf robot autom ind, icrai
        bae h, 2019, ieee int conf intell rob syst
        paparisabet ma, 2019, multibody syst dyn park g, 2019, iecon proc
        yano h, 2019, ifac-papersonline jeong h, 2019, ieee trans rob
        luo a, 2019, ieee glob conf consumer electron, gcce
        rossi lf, 2019, j braz soc mech sci eng
        kasaei m, 2019, ieee int conf intell rob syst
        riyanto, 2019, int j electr eng informatics
        kvalheim md, 2019, nonlinear dyn zhao f, 2019, appl sci
        lee ky, 2019, proc marss : int conf manip, autom, robot small scales
        khadiv m, 2019, iran j sci technol trans mech eng
        koco e, 2019, j intell rob syst theor appl
        shang w, 2019, ieee int conf cyber technol autom, control intell syst, cyber
        li x, 2019, ieee trans ind inf
        sharma r, 2019, int j innov technol explor eng
        yuan h-h, 2019, j electr eng technol
        shiguematsu ym, 2019, proc ieee/sice int symp syst integration, sii
        wang s, 2019, chinese control conf, ccc
        yuan h-h, 2019, front inf technol electr eng
        li l, 2019, ieee robot autom saputra aa, 2019, ieee trans cogn dev syst 
        wang k, 2019, rob autom syst christie md, 2019, mech syst signal process
        xiao y-y, 2019, adv mater
        dominguez cam, 2019, congr mex de robot, comrob
        doosti p, 2019, j braz soc mech sci eng
        van der noot n, 2019, auton robots
        maiti tk, 2019, int symp devices, circuits syst, isdcs - proc
        hariharan r, 2019, int j eng adv technol hong y-d, 2019, sensors
        shaolei w, 2019, asia conf energy environ eng, aceee
        khadiv m, 2019, multibody syst dyn
        bzhikhatlov i, 2019, proc - int rus autom conf, rusautocon
        wu z, 2019, j appl mech trans asme
        sarkar a, 2019, j intell rob syst theor appl
        faraji s, 2019, int j rob res
        garcía j, 2019, int j inf technol decis mak fevre m, 2019, int j rob res
        hsu h-k, 2019, adv rob pan p, 2019, ieee sensors j
        babu adr, 2019, proc int conf trends electron informatics, icoei
        liu c, 2019, j intell rob syst theor appl
        woodward ma, 2019, ieee trans rob horn jc, 2019, ieee control syst lett
        bertos ga, 2019, ieee trans med rob bion
        raj m, 2019, intl j mach learn cybern
        kumar j, 2019, acm int conf proc ser
        holeyannavar k, 2019, int conf intell comput control syst, iccs
        bogue r, 2019, ind robot kuang y, 2019, eur j mech a solids
        magsino er, 2019, arpn j eng appl sci
        sherif s, 2019, proc int conf process control, pc
        arcos-legarda j, 2019, multibody syst dyn
        majumder a, 2019, acm int conf proc ser
        lee h-w, 2019, ieee int conf consum electron - taiwan, icce-tw
        fong j, 2019, ieee robot autom hildebrandt a-c, 2019, auton robots
        sanchez-magos m, 2019, int conf control, decis inf technol, codit
        yang l, 2019, isa trans
        kasaei mm, 2019, ieee int conf auton robot syst competitions, icarsc
        xi a, 2019, ieee caa j autom sin peidró a, 2019, mechatronics
        seo j, 2019, int j control autom syst
        hamed ka, 2019, ieee trans autom control singh n, 2019, sn appl sci
        arcos-legarda j, 2019, mechatronics
        bhandari g, 2019, acm int conf proc ser chang ah, 2019, robotica
        yu z, 2019, ieee trans ind inf
        ferdous mf, 2019, int conf adv sci, eng robot technol, icasert
        da x, 2019, int j rob res joshi v, 2019, j r soc interface
        mahmoudi a, 2019, icee - iranian conf electr eng
        trkov m, 2019, ieee trans autom sci eng li l, 2019, j rob mechatronics
        fang w, 2019, front neurorobotics
        huan tt, 2018, proc int conf green technol sustain dev, gtsd
        tan kh, 2019, lect notes electr eng
        chattopadhyay p, 2019, mechatronic syst control
        zhang t, 2019, proc - ieee int conf robot comput, irc
        mobinipour v, 2019, int j humanoid rob xie z, 2019, proc mach learn res
        prasanga dk, 2019, adv rob wang l, 2019, j bionic eng
        le coënt a, 2019, lect notes comput sci jeong h, 2019, rob autom syst
        bao r, 2018, ieee int conf intell rob syst
        rhodes t, 2019, proc asme des eng tech conf
        elhosseini ma, 2019, j comput sci
        schilling m, 2019, adv intell sys comput
        li j, 2019, lect notes comput sci wang h, 2019, sens mater
        xie h, 2019, int j comput commun control
        mandava rk, 2019, int j model ident control
        wei x, 2019, mech mach theory gao z, 2019, neurocomputing
        pop n, 2019, period eng nat sci
        estrada e, 2019, ieee lat am conf comput intell, la-cci
        su m, 2019, appl sci bian h, 2019, lect notes comput sci
        mandava rk, 2019, evol intelligence mandava rk, 2019, 
        anjidani m, 2019, control optimisation calc var
        ruppert f, 2019, front neurorobotics
        gritli h, 2019, chaos - chaotic model simul int conf, proc
        gramala a, 2019, adv intell sys comput
        pi m, 2019, icarm - int conf adv robot mechatronics
        wu y, 2019, j intelligent fuzzy syst
        bharadwaj d, 2019, int j innov technol explor eng
        kim h, 2019, proc - ieee int conf robot comput, irc
        contreras b, 2019, commun comput info sci
        behera pk, 2019, int j comput vis rob
        bao r, 2018, ieee int conf intell rob syst-a chang q, 2019, appl sci
        prema r, 2019, int j innov technol explor eng
        de-león-gómez v, 2019, rob autom syst dong s, 2019, ieee access
        yoshida e, 2019, metode kovalev a, 2019, lect notes comput sci
        azocar af, 2019, ieee trans neural syst rehabil eng
        hariharan r, 2019, int j psychosoc rehab
        li m, 2019, icarm - int conf adv robot mechatronics
        akhond s, 2019, ieee access raković m, 2019, front neurorobotics
        mishra d, 2018, ieee uttar pradesh sect int conf electr, electron comput eng, upcon
        hu d, 2019, lect notes comput sci tiseo c, 2019, bioinspir biomimetics
        wu y, 2019, proc inst mech eng part c j mech eng sci
        wang k, 2019, robot transform future - proc int conf climbing walk robot support technol mob mach, clawar
        schütz s, 2019, icinco - proc int conf inf control, autom robot
        rai a, 2019, j mach learn res kormushev p, 2019, auton robots
        mandava rk, 2019, intelligent serv rob gil cr, 2019, appl sci
        janardhan v, 2019, robotica
        znegui w, 2019, proc int conf adv syst emergent technol, ic_aset
        wu q, 2019, icarm - int conf adv robot mechatronics
        raj m, 2019, j intell syst
        nourian zavareh m, 2018, int j bifurcation chaos
        li f, 2019, adv mater technol wahrmann d, 2019, int j humanoid rob
        miteva l, 2019, wseas trans syst control saab w, 2019, robotica
        mandava rk, 2019, acta polytech hung jing c, 2019, sains malays
        uchida y, 2019, int j appl electromagnet mech
        hanazawa y, 2019, j rob mechatronics zhu j, 2019, lect notes comput sci
        furukawa m, 2019, ieee conf virtual real 3d user interfaces, vr - proc
        corral e, 2019, mech mach sci kano t, 2019, front neurorobotics
        bittner b, 2018, nonlinear dyn
        sasagawa n, 2018, ieice trans fund electron commun comput sci
        nguyen v-t, 2018, int j mech eng robot res
        wang m, 2018, proceedings: iecon - annu conf ieee ind electron soc
        yazdani m, 2018, sci iran trevino j, 2018, ann biomed eng
        gan z, 2018, ieee robot autom mandava rk, 2018, int j autom comput
        sun t, 2018, ro-man - ieee int symp robot hum interact commun
        nansai s, 2018, appl sci lu y, 2018, int conf intell saf robot, isr
        mohamed sa, 2018, int conf robot autom eng, icrae
        ortiz a, 2018, int conf electr eng, comput sci autom control, cce
        lanini j, 2018, ieee robot autom song s, 2018, trans inst meas control
        liu y, 2018, proc ieee int conf mechatronics autom, icma
        wu y, 2018, j electr eng technol savoie w, 2018, artif life rob
        jing c, 2018, ieee int conf knowl innov invent, ickii
        hong m, 2018, int conf robot autom eng, icrae
        astudillo d, 2018, proc ieee int conf electron, electri eng comput, intercon
        zhu h, 2018, ind robot zhong y, 2018, adv rob wu j, 2018, adv mater
        yang w, 2018, adv mech eng kim m, 2018, ieee trans rob
        ren h, 2018, proc inst mech eng part c j mech eng sci
        lu w-c, 2018, ieee trans rob
        ravichandran r, 2018, proc int conf electron, commun aerosp technol, iceca
        maekawa a, 2018, acm siggraph emerg technol, siggraph
        honert ec, 2018, bioinspir biomimetics liu y, 2018, int j humanoid rob
        yazdani m, 2018, int j control autom syst
        hildebrandt a-c, 2018, int j adv rob syst satoh s, 2018, artif life rob
        moya v, 2018, argent conf autom control, aadeca
        folgheraiter m, 2018, int j humanoid rob harata y, 2018, artif life rob
        bajrami x, 2018, stroj cas
        gao l, 2018, proceedings: iecon - annu conf ieee ind electron soc
        zhou q, 2018, appl sci
        fahmizal, 2018, proc int conf inf technol electr eng: smart technol better soc, icitee
        chen k, 2018, robomech j
        tang c, 2018, ieee annu int conf cyber technol autom, control, intell syst, cyber
        gu s, 2018, appl sci
        zhang j, 2018, ieee conf virtual real 3d user interfaces, vr - proc
        konthong a, 2018, proceeding int jt conf comput sci softw eng, jcsse
        ferreira c, 2018, ieee int conf intell rob syst
        chattopadhyay p, 2018, int j rob autom
        jing z, 2018, j intell mater syst struct huan tt, 2018, neurocomputing
        clever d, 2018, int j rob res
        liu y, 2018, int conf inf sci technol, icist wang j, 2018, robotica
        yao d, 2018, int j rob autom nguyen q, 2018, int j rob res
        li x, 2018, chinese control conf, ccc
        kochuvila s, 2018, int conf electr, electron, commun, comput technol optim tech, iceeccot
        raj m, 2018, neural comput appl liu x, 2018, rob autom syst
        balakrishnan s, 2018, int j rob autom
        lee h-w, 2018, ieee int conf knowl innov invent, ickii
        ignasov j, 2018, artif life rob fallon m, 2018, interface focus
        gan z, 2018, j r soc interface wang z, 2018, j bionic eng
        riyanto, 2018, int conf control, autom, robot vis, icarcv
        liu c, 2018, int j adv rob syst lu x, 2018, ind robot
        cho b-k, 2018, int j precis eng manuf
        gasparri gm, 2018, ieee robot autom salazar r, 2018, smart mater struct
        sun q, 2018, robotica an k, 2018, j mech sci technol
        yao d, 2018, trans can soc mech eng rahmani m, 2018, jvc/j vib control
        zoghzoghy j, 2018, intl j dyn cont coral w, 2018, bioinspir biomimetics
        meng l, 2018, biol cybern gupta g, 2018, robotica
        gritli h, 2018, chaos solitons fractals wu y, 2018, j mech sci technol
        luo j, 2018, intelligent serv rob mandava rk, 2018, sadhana
        fevre m, 2018, ieee robot autom
        dettmann a, 2018, proc - int conf control, autom robot, iccar
        szots j, 2018, proc int carpathian control conf, iccc
        malchikov a, 2018, proc - int conf ind eng, appl manuf, icieam
        takuma t, 2018, auton robots giardina f, 2018, ieee trans rob
        sawada r, 2018, acm int conf proc ser
        zhang j, 2018, ieee trans visual comput graphics
        mohammed mq, 2018, int j mech mech eng
        seleem ia, 2018, proc ieee int conf ind technol
        hosokawa m, 2018, adv rob
        shiguematsu ym, 2018, ieee-ras int conf humanoid rob
        mergner t, 2018, front neurorobotics
        tǎtar mo, 2018, ieee int conf autom, qual test, robot, aqtr - theta ed, proc
        joe h-m, 2018, rob autom syst
        kouppas c, 2018, int conf control robot eng, iccre
        tatsch c, 2018, j intell rob syst theor appl
        sripada a, 2018, ieee int conf robot biomimetics, robio
        hussain i, 2018, int symp mechatronics appl, isma
        ding j, 2018, j intell rob syst theor appl
        song s, 2018, int j adv rob syst zhou x, 2018, ind robot
        li r, 2018, bioinspir biomimetics
        dolinsky k, 2018, ieee trans control syst technol
        del prete a, 2018, ieee trans rob
        jose wjd, 2018, proc - int conf control, autom robot, iccar
        shen k, 2018, artif life rob ramos j, 2018, ieee trans rob
        zhang y, 2018, ieee access
        khodabakhsh s, 2018, proc rsi int conf robot mechatronics, icrom
        liu d, 2018, tien tzu hsueh pao park h, 2018, j bionic eng
        beigzadeh b, 2018, int j humanoid rob
        li l, 2018, proc int conf mechatronics mach vis pract, m2vip
        hauser s, 2018, adv rob
        virgala i, 2018, int conf elektro, elektro conf proc
        luo x, 2018, int j humanoid rob he z, 2018, vibroeng procedia
        mizani a, 2018, proc rsi int conf robot mechatronics, icrom
        yoo sm, 2018, ieee-ras int conf humanoid rob
        singh g, 2018, ieee int conf power, control, signals instrum eng, icpcsi
        ossmy o, 2018, front neurorobotics kasaei sm, 2018, 
        shin h, 2018, adv rob liu c, 2018, j bionic eng
        bayraktaroğlu zy, 2018, gu j sci zeng h, 2018, macromol rapid commun
        godoy jc, 2018, int j adv rob syst khan mb, 2018, int j mech appl mech
        wahrmann d, 2018, int j adv rob syst
        mohammadreza kasaei s, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        zaytsev p, 2018, ieee trans rob saffar talori y, 2018, ieee access
        wang z, 2017, proc - chin autom congr, cac
        pajaziti a, 2018, ifac-papersonline yamamoto k, 2018, ieee robot autom
        pop n, 2018, int j eng technol liu c, 2018, lect notes comput sci
        he j, 2018, adv mech eng
        quintero d, 2018, ieee trans control syst technol
        minati l, 2018, ieee access young f, 2018, lect notes comput sci
        kwak b, 2018, j bionic eng yazdani m, 2018, rob autom syst
        dong ez, 2018, int j control autom syst
        calisti m, 2018, bioinspir biomimetics nițulescu m, 2018, mech mach sci
        al-shuka hfn, 2018, intl j dyn cont
        semwal vb, 2018, ieee trans autom sci eng
        aguirre a, 2017, proc - lars lat am robot symp sbr braz symp robot, lars-sbr - part robot conf
        khusainov r, 2018, lect notes electr eng
        nansai s, 2018, lect notes electr eng
        akiyama k, 2018, lect notes comput sci
        wang k, 2018, lect notes comput sci
        ferreira c, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        neves c, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        rico mesa em, 2018, commun comput info sci
        nikolić m, 2018, multibody syst dyn jiang x, 2018, appl sci
        nejadfard a, 2018, lect notes comput sci sun z, 2018, neurocomputing
        čelikovský s, 2018, ifac-papersonline he b, 2018, int j rob autom
        tsakiris dp, 2018, lect notes comput sci
        mandava rk, 2018, int j model ident control
        zhong g, 2018, ieee trans control syst technol
        chevallereau c, 2018, rob autom syst
        senthil kumaran b, 2018, int j eng technol
        sándor b, 2018, front neurorobotics
        fukuhara a, 2018, lect notes comput sci
        pham va, 2018, proc - int conf recent adv signal process, telecommun comput, sigtelcom
        reyes g, 2018, mech mach sci mandava rk, 2018, acm int conf proc ser
        hereid a, 2018, ieee trans rob
        montes h, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        urbain g, 2018, lect notes comput sci liu x, 2018, j r soc interface
        deng ka, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        zhu h, 2018, appl sci ito s, 2018, mechatronics
        vasudevan n, 2018, proc int astronaut congr, iac
        mrudul k, 2018, procedia comput sci liu c, 2018, int j adv rob syst-a
        liu q, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        quiñones ja, 2018, comput sist
        siravuru a, 2018, j intell rob syst theor appl
        dachlika t, 2018, hum- centric robot- proc int conf climbing walk robot support technol mob mach
        sohal ss, 2018, proc asme des eng tech conf
        mummolo c, 2018, j mech robot ayari a, 2018, intl j adv comput sci appl
        celemin c, 2018, lect notes comput sci cristiano j, 2018, 
        mostyn v, 2018, int j adv rob syst szczecinski ns, 2018, biol cybern
        farkhatdinov i, 2017, bioinspir biomimetics
        zang x, 2017, j mech med biol
        ayari a, 2017, int conf control, decision information technologies, codit
        takaira s, 2017, annu conf soc instrum control eng japan, sice
        laumond j-p, 2017, int j rob res boyer f, 2017, j nonlinear sci
        helin w, 2017, ieee int conf syst, man, cybern, smc
        zhou y, 2017, chinese control conf, ccc li c, 2017, adv rob
        chen x, 2017, ieee trans ind electron
        vasconcelos r, 2017, ieee int conf intell rob syst
        ames ad, 2017, nonlinear anal hybrid syst
        sasaki t, 2017, int conf robot autom sci, icras
        winkler aw, 2017, ieee robot autom
        hanazawa y, 2017, annu conf soc instrum control eng japan, sice
        ebrahimi a, 2017, intl j dyn cont
        vu mn, 2017, ieee int conf mechatronics autom, icma
        sai vijayanath reddy g, 2017, indian j public health res dev
        bzhikhatlov i, 2017, int conf ind eng, appl manuf, icieam - proc
        harish b, 2017, indian j public health res dev
        han s-h, 2017, int conf control, autom syst
        janardhan v, 2017, j intell rob syst theor appl
        sai dinakar k, 2017, indian j public health res dev
        zhang z, 2017, annu conf soc instrum control eng japan, sice
        kim m, 2017, front neurorobotics lin j-l, 2017, ieee access
        bazaz behbahani s, 2017, j nonlinear sci majewski t, 2017, j mech robot
        mummolo c, 2017, j nonlinear sci nakanishi h, 2017, j rob mechatronics
        tanaka d, 2017, artif life rob
        zhan q, 2017, proc - int conf comput technol, electron commun, icctec
        satici ac, 2017, int j control martínez pa, 2017, intelligent serv rob
        daily-diamond ca, 2017, bioinspir biomimetics
        remy cd, 2017, int j rob res macedo j, 2017, rob autom syst
        kinugasa t, 2017, annu conf soc instrum control eng japan, sice
        li w, 2017, bioinspir biomimetics
        yang j, 2017, ieee int conf mechatronics autom, icma
        janardhan v, 2017, rob autom syst
        yu w, 2017, ieee int conf mechatronics autom, icma
        liu h, 2017, ieee int conf mechatronics autom, icma
        wahrmann d, 2017, ieee asme int conf adv intellig mechatron aim
        sasaki h, 2017, annu conf soc instrum control eng japan, sice
        lee y, 2017, rob autom syst wang l, 2017, neural comput appl
        vu mn, 2017, ieee int conf mechatronics autom, icma-a
        pham va, 2017, ieee int conf syst eng technol, icset - proc
        martin ae, 2017, ieee trans autom control
        akbari hamed k, 2017, nonlinear anal hybrid syst
        huang z, 2017, ieee int conf mechatronics autom, icma
        bajrami x, 2017, int j mech eng technol
        garcia-rodriguez r, 2017, eng appl artif intell
        ezati m, 2017, int j humanoid rob wu w, 2017, rob autom syst
        montano o, 2017, auton robots zang x, 2017, appl sci
        bazeille s, 2017, robotica muscolo gg, 2017, appl sci
        hwang k-s, 2017, ieee trans ind inf
        lopez-caudana eo, 2017, int j adv rob syst
        chafroud n, 2017, proc int conf adv syst electr technol, ic_aset
        luo j-w, 2017, adv rob
        valle cmco, 2017, ieee latin am conf comput intell, la-cci - proc
        kuang y, 2017, ieee int conf robot biomimetics, robio
        ding w, 2017, proc inst mech eng part c j mech eng sci
        khomariah ne, 2017, adv sci lett
        akhtaruzzaman m, 2017, int j autom comput tian y, 2017, mech mach theory
        mazumdar a, 2017, ieee asme trans mechatron
        van tien an, 2017, int conf ubiquitous robot ambient intell, urai
        martin wc, 2017, ieee robot autom
        javed my, 2017, int conf robot autom eng, icrae
        asano f, 2017, j rob mechatronics
        zhang l, 2017, proc - youth acad annu conf chin assoc autom, yac
        wang p, 2017, ieee int conf cybern intell syst, cis ieee conf robot, autom mechatronics, ram - proc
        hanazawa y, 2017, j rob mechatronics qaiser z, 2017, mech mach theory
        nazemi f, 2017, rsi int conf robot mechatronics, icrom
        ma w-l, 2017, hscc - proc int conf hybrid syst: comput control (part cps week)
        kamalakannan sr, 2017, int conf comput, commun, signal process: special focus iot, icccsp
        khadiv m, 2017, proc inst mech eng part i j syst control eng
        zang x, 2017, proc - ieee int conf robot comput, irc
        suhasini u, 2017, int j mech eng technol li x, 2017, j rob mechatronics
        hunt a, 2017, front neurorobotics
        lee sm, 2017, int conf ubiquitous robot ambient intell, urai
        nguyen ndk, 2017, int conf ubiquitous robot ambient intell, urai
        jafri sra, 2017, int conf latest trends in electr eng comput technol, intellect
        abedi e, 2017, proc - int conf comput intell commun networks, cicn
        panwar r, 2017, ieee uttar pradesh sect int conf electr, comput electron, upcon
        luxman r, 2017, int j adv rob syst liu y, 2017, appl sci
        khadiv m, 2017, rsi int conf robot mechatronics, icrom
        zhao h, 2017, robotica
        bajrami x, 2017, proc - int conf control, artif intell, robot optim, iccairo
        huang y, 2017, ieee trans syst man cybern syst
        de-león-gómez v, 2017, simul model pract theory
        an k, 2017, j mech sci technol
        chevallereau c, 2017, bioinspir biomimetics gupta s, 2017, adv rob
        patel vj, 2017, acm int conf proc ser
        eslami m, 2017, rsi int conf robot mechatronics, icrom
        shafiee-ashtiani m, 2017, rsi int conf robot mechatronics, icrom
        hashlamon i, 2017, robotica gao w, 2017, robotica
        davari m, 2017, conf artif intell robotics, iranopen
        ura d, 2017, j rob mechatronics garcía j, 2017, knowl inf systems syst
        li x, 2017, artif life rob hyon s-h, 2017, ieee asme trans mechatron
        razavi h, 2017, auton robots
        khadiv m, 2017, rsi int conf robot mechatronics, icrom-a
        ding j, 2017, ieee int conf robot biomimetics, robio
        takuma t, 2017, j rob mechatronics
        liu y, 2017, ieee int conf robot biomimetics, robio
        mazumdar a, 2017, ieee robot autom
        alves j, 2017, ieee int conf auton robot syst compet, icarsc
        lin y-t, 2017, int autom control conf, cacs
        luat th, 2017, int j humanoid rob
        seleem ia, 2017, proc ieee int conf ind technol
        esfanabadi vs, 2017, rsi int conf robot mechatronics, icrom
        qin z, 2017, int conf adv rob mechatron, icarm
        rasouli f, 2017, rsi int conf robot mechatronics, icrom
        kashem sba, 2017, int conf comput drone appl: ethical integr comput drone technol humanit sustain, iconda
        roberts d, 2017, robotica
        suzuki h, 2017, int conf ubiquitous robot ambient intell, urai
        de-león-gómez v, 2017, int j adv rob syst
        kuswadi s, 2017, proc - int conf electr eng informatics: adv knowl, res, technol humanit, iceltics
        thirumalaraju p, 2017, proc int conf robotics: curr trends future chall rctfc
        wang h, 2017, ieee int conf robot biomimetics, robio
        mozaffari s, 2017, rsi int conf robot mechatronics, icrom
        smit-anseeuw n, 2017, ieee robot autom griffin b, 2017, int j rob res
        liu y, 2017, ieee int conf inf autom, icia
        tian w, 2017, lect notes comput sci
        alvarado d, 2017, lect notes comput sci li t-hs, 2017, ieee access
        ahmad sharbafi m, 2017, j biomech yuan q, 2017, lect notes comput sci
        lancheros pn, 2017, ieee colomb conf robotics autom, ccra - conf proc
        liu x, 2017, adv intell sys comput zhao h, 2017, auton robots
        bhounsule pa, 2017, j biomech wang z, 2017, acta tech csav
        zhou z, 2017, proc ieee adv inf manag, commun, electron autom control conf, imcec
        nandi gc, 2017, ieee reg 10 annu int conf proc tencon
        dimas pristovani r, 2017, proc - int electron symp, ies
        xia z, 2017, int j adv rob syst titov a, 2017, commun comput info sci
        guerra-hernandez ei, 2017, ieee access li h, 2017, j mech sci technol
        christie md, 2017, smart mater struct
        hashemi e, 2017, proc inst mech eng part k j multi-body dyn
        wu x, 2017, ieee int conf inf autom, icia
        muscolo gg, 2017, int j humanoid rob
        huang y, 2017, lect notes comput sci zhu h, 2017, ind robot
        javad hasaneini s, 2017, robotica borina a, 2017, lect notes mech eng
        senoo t, 2017, robotica deng k, 2017, int j humanoid rob
        olcay t, 2017, turk j electr eng comput sci
        cristiano j, 2017, j phys agents
        bortoletto r, 2017, adv intell sys comput
        li p, 2017, lect notes comput sci
        khusainov r, 2017, icinco - proc int conf inf control, autom robot
        popov d, 2017, icinco - proc int conf inf control, autom robot
        tighzert l, 2017, proc int conf model, identif control, icmic
        muscolo gg, 2017, proc eccomas themat conf multibody dynamics, mbd
        russo m, 2017, int j mech control
        chen w, 2017, ieee int conf inf autom, icia
        wu x, 2017, ieee int conf inf autom, icia-a
        wang z, 2017, j intell rob syst theor appl
        szczecinski ns, 2017, biol cybern
        cao zb, 2017, inf sci electron eng - proc int conf electron eng inf sci
        li y, 2017, ieee int conf inf autom, icia
        muscolo gg, 2017, proc eccomas themat conf multibody dynamics, mbd-a
        lanari l, 2017, lect notes comput sci li k, 2017, procedia eng
        heydari r, 2017, int j control autom syst kanner oy, 2017, ieee access
        mendez-monroy pe, 2017, int j comput commun control
        hashlamon i, 2017, jordan j mech ind eng perrin n, 2017, ieee trans rob
        ackerman j, 2017, j biomech lahr d, 2017, j adv mech des syst manuf
        sheard j, 2017, lect notes comput sci zhou y, 2017, ind robot
        fang h, 2017, proc spie int soc opt eng
        nguyen td, 2017, lect notes electr eng
        gorobtsov as, 2017, commun comput info sci
        al hajjar a, 2017, int conf bio-eng smart technol, biosmart
        ferreira c, 2017, biol cybern
        iqbal s, 2017, proc - sims: int conf syst inform, model simul
        zhu h, 2017, sii - ieee/sice int symp syst integr
        azimi m, 2017, j mech sci technol
        saputra aa, 2017, proc - int electron symp, ies
        fang h, 2017, j sound vib miao z, 2017, proc asme des eng tech conf
        kamala ksr, 2017, j mech eng res dev deng k, 2017, rob autom syst
        sun c, 2017, ieee trans syst man cybern syst
        baskoro as, 2017, proc - int electron symp, ies
        wallbridge cd, 2017, lect notes comput sci
        chernousko fl, 2017, procedia comput sci
        zhang l, 2017, int j adv rob syst yi q, 2017, lect notes comput sci
        nguyen v-t, 2017, int conf model appl simul, mas, held int multidiscip model simul multiconference, i3m
        abdolmaleki a, 2017, lect notes comput sci
        kutilek p, 2017, proc int conf mechatron - mechatronika, me
        shamna p, 2017, proc int conf electron, commun aerosp technol, iceca
        lim s, 2016, j electr eng technol mamiya s, 2016, j rob mechatronics
        chen z, 2016, rob autom syst
        de brito novaes ce, 2016, j control autom electr syst
        taghvaei s, 2016, iran j sci technol trans mech eng
        wu h, 2016, ieee int conf mechatronics autom, ieee icma
        audren h, 2016, ieee-ras int conf humanoid rob
        suebsaiprom p, 2017, control eng pract
        chen j-y, 2016, j chin inst eng trans chin inst eng ser a
        hubicki c, 2016, int j rob res zhang y, 2017, mech mach sci
        liu g, 2016, ieee int conf mechatronics autom, ieee icma
        zhang z, 2016, ieee int conf mechatronics autom, ieee icma
        focchi m, 2017, auton robots kim d, 2016, ieee trans rob
        liu m, 2016, proc - int conf inf sci control eng, icisce
        amanatiadis a, 2016, ieee trans ind electron
        behbahani sb, 2016, ieee trans rob
        li j, 2016, ieee int conf mechatronics autom, ieee icma
        nguyen ndk, 2017, lect notes electr eng an k, 2016, int j adv rob syst
        li x, 2016, j adv comput intell intelligent informatics
        russo m, 2017, mech mach sci
        yu j, 2016, int conf ubiquitous robots ambient intell, urai
        sun z, 2016, optim control appl methods
        yu h, 2016, ieee trans ind electron
        pantoja-garcía js, 2017, revint metodos numer calc disen ing
        ryoo y-j, 2016, int j humanoid rob yang l, 2016, nonlinear dyn
        li x, 2016, ieee int conf mechatronics autom, ieee icma
        saputra aa, 2016, ieee congr evol comput, cec
        ding j, 2016, int j rob autom becker f, 2017, mech mach sci
        rosado j, 2016, proc - int conf auton robot syst compet, icarsc
        nițulescu m, 2017, mech mach sci
        santos cp, 2017, j intell rob syst theor appl
        seleem ia, 2016, proc - int conf inf sci control eng, icisce
        bauer f, 2016, multibody syst dyn
        lee s, 2016, ieee int conf mechatronics autom, ieee icma
        gong x, 2016, adv mater liu c, 2016, j bionic eng
        lipták t, 2016, int j adv rob syst
        figueiredo j, 2016, proc - int conf auton robot syst compet, icarsc
        brown tl, 2016, ieee trans rob
        wang c, 2016, ieee int conf mechatronics autom, ieee icma
        zhu y, 2016, sensors
        kondo y, 2016, proc - jt int conf soft comput intell syst int symp adv intell syst, scis-isis
        kasun prasanga d, 2016, iecon proc
        han s, 2016, ssrr - int symp saf, secur rescue robot
        wang p, 2016, adv mech eng
        mandava rk, 2016, int conf electr, electron, optim techniques, iceeot
        lee w-k, 2016, j electr eng technol moon j-s, 2016, robotica
        arouri w, 2016, mediterr j meas control
        he y-d, 2016, j beijing inst technol engl ed
        abdolmaleki a, 2016, j intell rob syst theor appl
        dong e, 2016, ieee int conf mechatronics autom, ieee icma
        rosado j, 2016, j intell rob syst theor appl
        alghooneh m, 2016, ieee asme trans mechatron
        song c-w, 2016, j bionic eng
        ayari a, 2016, proc int conf model, identif control, icmic
        brandão m, 2016, ieee trans rob kuindersma s, 2016, auton robots
        lee j, 2016, compos struct gritli h, 2016, appl math model
        umedachi t, 2016, bioinspir biomimetics yamamoto k, 2016, rob autom syst
        iwata h, 2016, acm siggraph emerg technol, siggraph
        liu c, 2016, icnsc - ieee int conf netw, sens control
        martin ae, 2016, ieee trans rob
        dakhli i, 2016, int multi-conf syst, signals devices, ssd
        yang j, 2016, chinese control conf, ccc
        shiguematsu ym, 2016, int j humanoid rob
        yu z, 2016, ieee trans syst man cybern syst
        goto k, 2016, j rob mechatronics kim y-j, 2016, robotica
        saputra aa, 2016, ieee trans syst man cybern syst
        hwang k-s, 2016, j inf sci eng semwal vb, 2016, ieee sensors j
        hong y-d, 2016, int j adv rob syst
        sayed bm, 2016, proc asia-pac conf intell robot syst, acirs
        ugurlu b, 2016, ieee asme trans mechatron
        skidmore j, 2016, ieee trans neural syst rehabil eng
        hong y-d, 2016, j electr eng technol
        tsai c-s, 2016, icic express lett part b appl
        hashlamon i, 2016, robotica
        sheba jk, 2016, int conf inf, commun signal process, icics
        kobayashi t, 2016, adv rob
        yang l, 2016, proc chin control decis conf, ccdc
        murai s, 2016, proc - int conf multimed syst signal process, icmssp
        beranek r, 2016, j intell rob syst theor appl
        hong y-d, 2016, j electr eng technol-a tian y, 2016, robotica
        tuhtan ja, 2016, underw technol hu y, 2016, robotica
        zhang y, 2016, proc - int symp comput intell des, iscid
        chen x, 2016, robotica gritli h, 2016, nonlinear dyn
        menga g, 2016, inventions
        hindlekar s, 2016, acm siggraph vr village, siggraph
        safa at, 2016, mech mach theory zhu h, 2016, j bionic eng
        zang x, 2016, adv mech eng
        sfakiotakis m, 2016, mediterr conf control autom, med
        ren z, 2016, bioinspir biomimetics jin h, 2016, asian j control
        jiang n, 2016, smart mater struct liu j, 2016, rob autom syst
        sabaapour mr, 2016, adv rob wang x, 2016, rob comput integr manuf
        zhang q, 2016, j chin soc mech eng trans chin inst eng ser c
        menga g, 2016, inventions-a hu y, 2016, chinese control conf, ccc
        ercan h, 2016, proc asia-pac conf intell robot syst, acirs
        hu k, 2016, ieee trans rob cao y, 2016, robotica
        shi h, 2016, ieee/acis int conf softw eng, artif intell, netw parallel/ distrib comput, snpd
        miller buffinton c, 2016, j biomech eng
        shi h, 2016, int j netw distrib comput xi w, 2016, int j rob res
        zhao h, 2016, ieee trans autom sci eng masuya k, 2016, adv rob
        zang x, 2016, technol health care gao j, 2016, ieee trans biomed eng
        martínez-fonseca n, 2016, isa trans
        wang z, 2016, trans inst meas control
        aguilar lm, 2016, chilecon - ieee chilean conf electr, electron eng, inf commun technol, proc ieee chilecon
        behn c, 2016, mechatronics zhou c, 2016, auton robots
        halataei f, 2016, conf proc int conf knowl-based eng innov, kbei
        andré j, 2016, j intell rob syst theor appl
        hamed ka, 2016, int j rob res ranganathan r, 2016, j biomech
        zhang y, 2016, j intell rob syst theor appl
        wei z, 2016, proc chin control decis conf, ccdc
        menga g, 2016, inventions-a-b lee h-w, 2016, robotica
        komatsu t, 2016, int j modell simul
        osuna l, 2015, ieee-ras int conf humanoid rob
        shibata m, 2016, adv coop robot
        kim d, 2015, ieee-ras int conf humanoid rob
        wasielica m, 2016, adv coop robot bajrami x, 2016, ifac-papersonline
        mehmeti x, 2016, ifac-papersonline
        abourachid a, 2016, lect notes comput sci
        lee s, 2016, intelligent serv rob feirstein ds, 2016, ifac-papersonline
        jaramillo-avila u, 2016, int j adv rob syst wu m-h, 2016, adv rob
        huang y, 2015, neurocomputing zhang j, 2016, asian j control
        luo rc, 2016, ieee trans ind electron gutman e, 2016, ieee trans rob
        deng k, 2016, rob autom syst liu c, 2016, chin j mech eng engl ed
        rose-andrieux r, 2016, adv coop robot
        joukov v, 2015, ieee-ras int conf humanoid rob
        yi y, 2016, trans inst meas control
        prasanth h, 2016, lect notes mech eng
        wittmann r, 2015, ieee-ras int conf humanoid rob
        singh r, 2016, lect notes mech eng
        jiwankar a, 2016, ieee int conf comput commun control, ic4
        liu z, 2016, appl soft comput j
        herzog a, 2015, ieee-ras int conf humanoid rob
        luo rc, 2016, proc - ieee int conf syst, man, cybern, smc
        tavakoli f, 2015, int conf robot mechatronics, icrom
        li w, 2016, lect notes comput sci na b, 2016, ifac-papersonline
        liu q, 2016, adv coop robot de-león-gómez v, 2016, mech mach sci
        kim j-w, 2016, int j adv rob syst
        aliac cjg, 2016, int conf humanoid, nanotechnol, inf technol, commun control, environ manage, hnicem
        spyrakos-papastavridis e, 2015, ieee-ras int conf humanoid rob
        snafii n, 2015, int j adv rob syst
        lack j, 2015, ieee-ras int conf humanoid rob
        mummolo c, 2015, ieee-ras int conf humanoid rob
        peidró a, 2016, lect notes electr eng
        van chien d, 2015, iccas - int conf control, autom syst, proc
        ezati m, 2015, int conf robot mechatronics, icrom
        lugo jh, 2016, adv coop robot
        rodríguez-cianca d, 2015, ieee-ras int conf humanoid rob
        yano t, 2016, lect notes eng comput sci
        nakaoka s, 2015, ieee-ras int conf humanoid rob
        alfayad s, 2016, int rev mech eng rijnen mwlm, 2016, ifac-papersonline
        jang j, 2015, iccas - int conf control, autom syst, proc
        da x, 2016, ieee access ishihara k, 2015, ieee-ras int conf humanoid rob
        xinjilefu x, 2015, ieee-ras int conf humanoid rob
        hsieh t-c, 2016, proc spie int soc opt eng
        jiwankar a, 2016, int conf comput, commun secur, icccs
        savić sz, 2016, therm sci
        hopkins ma, 2015, ieee-ras int conf humanoid rob
        yano t, 2016, int j mech eng robot res
        rameez m, 2015, iccas - int conf control, autom syst, proc
        ding x, 2016, j dyn syst meas control trans asme
        albitar h, 2016, int j adv rob syst lin j-l, 2016, ieee access
        khusainov r, 2016, icinco - proc int conf inf control, auto robot
        sørensen ctl, 2016, lect notes comput sci
        ferreira c, 2015, neurocomputing
        ehsaniseresht a, 2015, int conf robot mechatronics, icrom
        li x, 2016, ieee int conf robot biomim, robio
        colasanto l, 2015, ieee-ras int conf humanoid rob
        becker f, 2016, int symp robot, isr
        spyrakos-papastavridis e, 2015, ieee-ras int conf humanoid rob-a
        baca j, 2016, springer tracts adv rob bauer f, 2016, nonlinear dyn
        li f, 2016, int j bioautomotion yudaev sa, 2016, ceur workshop proc
        borina a, 2016, lect notes mech eng
        di canio g, 2016, lect notes comput sci
        khusainov r, 2016, lect notes electr eng
        xi a, 2016, lect notes comput sci bridgwater t, 2016, ifac-papersonline
        urbann o, 2015, ieee-ras int conf humanoid rob
        luo m, 2015, bioinspir biomimetics
        folkertsma ga, 2015, ifac-papersonline
        olivier j, 2015, ieee int conf rehabil rob
        hwang k-s, 2015, ieee trans syst man cybern syst
        an k, 2015, j mech sci technol matsubara t, 2015, biol cybern
        zhang x, 2015, ieee int conf inf autom, icia - conjunction ieee int conf autom logist
        hildebrandt a-c, 2015, ieee int conf intell rob syst
        yuan l, 2015, proc int conf fluid power mechatron, fpm
        fang h, 2015, multibody syst dyn
        apostolopoulos s, 2015, ieee int conf intell rob syst
        aoustin y, 2015, int j humanoid rob sun g, 2015, int j adv rob syst
        liu c, 2015, ieee int conf inf autom, icia - conjunction ieee int conf autom logist
        ramos oe, 2015, ieee-ras int conf humanoid rob
        peidro a, 2015, int j adv rob syst fang h, 2015, multibody syst dyn-a
        kamioka t, 2015, ieee int conf intell rob syst
        hong y-d, 2015, j electr eng technol
        chen d, 2015, annu conf soc instr control eng japan, sice
        seiterle s, 2015, j biomech
        gautam r, 2015, icetech - ieee int conf eng technol
        wittmann r, 2015, ieee int conf intell rob syst
        sekiguchi a, 2015, annu conf soc instr control eng japan, sice
        motahar ms, 2015, ieee int conf intell rob syst
        miladi y, 2015, int multi-conf syst, signals devices, ssd
        deng z, 2015, j mech sci technol
        batts z, 2015, ieee int conf intell rob syst
        spitz j, 2015, bioinspir biomimetics renjewski d, 2015, ieee trans rob
        lee h, 2015, ieee trans neural syst rehabil eng
        romão jc, 2015, ieee int conf intell rob syst
        buschmann t, 2015, bioinspir biomimetics
        brasseur c, 2015, ieee-ras int conf humanoid rob
        zoghzoghy j, 2015, mechatronics
        faidhon n, 2015, iccerec - int conf control, electron, renew energy commun
        zhang y, 2015, ieee int conf cyber technol autom, control, intell syst, cyber
        cicconofri g, 2015, proc r soc a math phys eng sci
        kai t, 2015, j control autom electr syst
        billah mm, 2015, natl symp inf technol: towards new smart world, nsitnsw
        eljaik j, 2015, ieee int conf intell rob syst
        song s, 2015, chinese control conf, ccc
        araujo afr, 2015, ieee trans neural networks learn sys
        zhao j, 2015, ieee int conf mechatronics autom, icma
        muscolo gg, 2015, robotica he b, 2015, robotica
        lee k-m, 2015, j bionic eng
        hou w, 2015, proc - int conf control, autom robotics, iccar
        van der noot n, 2015, ieee int conf intell rob syst
        montano o, 2015, eur control conf, ecc
        khan mr, 2015, ieee int symp robotics manuf autom, ieee-roma
        xie k, 2015, ieee int conf mechatronics autom, icma
        wang z, 2015, int j humanoid rob
        methenitis g, 2015, gecco - proc genet evol comput conf
        li t, 2015, robotica shahbazi h, 2015, robotica
        wang f, 2015, proc ieee conf industrial electron appl, iciea
        wang b, 2015, chinese control conf, ccc
        tang c, 2015, trans inst meas control karssen jgd, 2015, robotica
        kaiser p, 2015, int j humanoid rob
        peng p, 2015, int conf serv syst serv manag, icsssm
        lei y, 2015, ieee int conf mechatronics autom, icma
        talebi m, 2015, ai robotics, iranopen - conf artif intell robotics
        wang n, 2015, int j mech mater des
        kaneko t, 2015, ieee int conf intell rob syst liu x, 2015, adv mech eng
        li h, 2015, ieee int conf cyber technol autom, control, intell syst, cyber
        li c, 2015, bioinspir biomimetics
        wang h, 2015, chinese control conf, ccc
        fujiki s, 2015, j r soc interface gor mm, 2015, rob autom syst
        li c, 2015, front inf technol electr eng
        lanari l, 2015, ieee-ras int conf humanoid rob wang h, 2015, engineering
        kaddar b, 2015, rob autom syst
        khazenifard a, 2015, icee - proc iran conf electr eng
        go g, 2015, ieee trans magn
        wu b, 2015, proc world congr intelligent control autom wcica
        wong c-c, 2015, j chin inst eng trans chin inst eng ser a
        zhang w, 2015, proc world congr intelligent control autom wcica
        yan g, 2015, robotica plaut rh, 2015, int j non linear mech
        kim y-j, 2015, int j humanoid rob li m, 2015, high technol letters
        cordova-villarreal cm, 2015, proc ieee north west russia sect young res electr electron eng conf, elconrusnw
        rajendra rega, 2015, sadhana sabaapour mr, 2015, adv rob
        xu l, 2015, j terramech dehghani r, 2015, multibody syst dyn
        kim y-j, 2015, int j humanoid rob-a
        rosado j, 2015, proc - ieee int conf auton robot syst compet, icarsc
        liu j, 2015, jiqiren song ys, 2015, ieee trans neural syst rehabil eng
        wang f, 2015, proc world congr intelligent control autom wcica
        moya j, 2015, int j humanoid rob zeng h, 2015, adv mater
        sellami ma, 2015, proc ieee int conf ind technol
        luo x, 2015, rob autom syst iscen a, 2015, artif life
        zhang h, 2015, j inf comput sci zhu h, 2015, ieee asme trans mechatron
        englsberger j, 2015, ieee trans rob
        ferreira c, 2015, proc - ieee port meet bioeng, enbeng
        yi s-j, 2015, ieee-ras int conf humanoid rob
        wang h, 2015, proc world congr intelligent control autom wcica
        an k, 2015, adv mech eng ding w, 2015, chin j mech eng engl ed
        kim y-b, 2015, isocc - int soc des conf chen c-p, 2015, sensors
        hill j, 2015, robotica das a, 2015, acm int conf proc ser
        wang m, 2015, chin j mech eng engl ed masuya k, 2015, adv rob
        sfakiotakis m, 2015, robotica piovan g, 2015, int j rob res
        liang z, 2015, int j modell simul
        zielinska t, 2015, iftomm world congr proc, iftomm
        ramos fm, 2015, proc - sbr braz rob symp, lars latin am rob symp robocontrol workshop appl rob autom, sbr lars robocontrol - part jt conf rob intell syst, jcris
        li t-hs, 2015, ieee access
        rocha-cozatl e, 2015, proc - int conf mechatronics, electron, automot eng, icmeae
        khusainov r, 2015, icinco - int conf informatics control, autom robot, proc
        leottau l, 2015, lect notes artif intell
        kim y-m, 2015, adv intell sys comput
        shafii n, 2015, lect notes artif intell
        mayr j, 2015, proc eccomas themat conf multibody dyn, multibody dyn
        kulakov db, 2015, procedia eng safa at, 2015, assist robot
        ding j, 2015, lect notes comput sci nguyen q, 2015, ifac-papersonline
        tachi s, 2015, lect notes comput sci
        saputra aa, 2015, lect notes comput sci
        zhang q, 2015, lect notes comput sci
        homma t, 2015, proc spie int soc opt eng galloway k, 2015, ieee access
        sabzehzar a, 2015, procedia comput sci
        maciel eh, 2015, commun comput info sci
        bouhajar s, 2015, procedia comput sci
        maciel eh, 2015, proc - sbr braz rob symp, lars latin am rob symp robocontrol workshop appl rob autom, sbr lars robocontrol - part jt conf rob intell syst, jcris
        gor mms, 2015, simulation
        zhu h, 2015, ieee int conf robotics biomimetics, ieee-robio
        sun z, 2015, ifac-papersonline you y, 2015, assist robot
        tereshin v, 2015, lect notes control inf sci zhao j, 2015, assist robot
        hou w, 2015, int j rob autom bolotnik n, 2015, ifac-papersonline
        xie h, 2015, int j bioautomotion majewski t, 2015, mech mach sci
        liu y, 2015, bio-med mater eng liu c, 2015, lect notes electr eng
        farzadpour f, 2015, proc inst mech eng part c j mech eng sci
        hariri hh, 2015, iftomm world congr proc, iftomm
        rosado j, 2015, lect notes comput sci
        wang y, 2015, lect notes comput sci
        taherkhorsandi m, 2015, nonlinear dyn
        leottau dl, 2015, lect notes comput sci
        shin h-k, 2015, ieee trans ind electron
        shafii n, 2015, j intell rob syst theor appl ren z, 2015, assist robot
        wang k, 2015, int j simul syst sci technol lee i-f, 2015, j appl sci eng
        coral w, 2015, icinco - int conf informatics control, autom robot, proc
        gritli h, 2015, nonlinear dyn liu q, 2015, assist robot
        sadati smh, 2015, procedia comput sci
        kobayashi d, 2015, j rob mechatronics
        lin p-h, 2015, iftomm world congr proc, iftomm
        silva m, 2015, proc - eurosim congr model simul, eurosim
        peidró a, 2015, icinco - int conf informatics control, autom robot, proc
        gamus b, 2015, siam j appl dyn syst elhasairi a, 2015, front robot ai
        bustos a, 2015, iftomm world congr proc, iftomm
        cristiano j, 2015, rob autom syst onn n, 2015, wseas trans syst control
        pan x, 2015, assist robot heo j-w, 2015, ieee trans ind electron
        valadao ct, 2015, ifac-papersonline
        andré j, 2015, j intell rob syst theor appl
        kolathaya s, 2015, ifac-papersonline lin h-c, 2014, robotica
        abedi m, 2014, rsi/ism int conf robot mechatronics, icrom
        dadashzadeh b, 2014, rsi/ism int conf robot mechatronics, icrom
        imanishi h, 2014, proc sice annu conf
        guettas c, 2014, int conf multimedia comput syst proc
        yu z, 2014, intell autom soft comp
        vaghei y, 2014, rsi/ism int conf robot mechatronics, icrom
        zafari n, 2014, rsi/ism int conf robot mechatronics, icrom
        sarkar a, 2015, rob autom syst kim y-j, 2014, ind robot
        asano f, 2015, multibody syst dyn corral e, 2014, int j adv rob syst
        shen zh, 2014, bioinspir biomimetics gan c-b, 2014, acta mech sin
        liu lm, 2014, chinese control conf, ccc martin ae, 2014, int j rob res
        lee j, 2014, proc ieee annual northeast bioengineering conf, nebec
        wu b, 2014, chinese control conf, ccc
        kumar as, 2014, int conf comput commun netw technol, icccnt
        oviedo-barriga j, 2015, robotica
        li q, 2014, proc - int conf intelligent hum-mach syst cybernetics, ihmsc
        alghooneh m, 2014, robotica li t, 2014, j bionic eng
        azarkaman m, 2014, iran conf electr eng, icee
        evangelista g, 2014, int conf methods model autom robot, mmar
        saeki k, 2014, analog integr circuits signal process
        uchiyama n, 2014, j rob mechatronics omer a, 2014, int j adv rob syst
        ezati m, 2014, rsi/ism int conf robot mechatronics, icrom
        zhao h, 2014, optim control appl methods
        yeon js, 2014, j mech sci technol he b, 2014, int j adv rob syst
        liu g-h, 2014, j bionic eng park j, 2014, adv rob
        huang y, 2014, biol cybern ding w, 2014, adv rob
        jiang y, 2014, ieee int conf inf autom, icia
        kim d, 2014, j mech sci technol
        heydari r, 2014, iran conf electr eng, icee
        park i-w, 2014, j nanosci nanotechnol
        zhong y, 2014, proc - ieee workshop adv res technol ind appl, wartia
        asano f, 2014, rose - ieee int symp robot sensors environ, proc
        rashidi sf, 2014, rsi/ism int conf robot mechatronics, icrom
        kim h, 2014, j bionic eng zhu h, 2014, adv rob
        bhounsule pa, 2014, int j rob res
        wang h, 2014, proc ieee int conf rob autom wong rj, 2015, robotica
        liang z, 2014, int j rob autom
        azimi m, 2014, rsi/ism int conf robot mechatronics, icrom
        motoc im, 2014, proc - int conf emerg secur technol, est
        raković m, 2014, ieee trans rob
        conduraru slatineanu a, 2014, appl mech mater
        balakrishnan s, 2014, int conf inf autom sustain: sharpening futur sustain technol, iciafs
        lee hw, 2014, int j rob autom
        kamogawa y, 2014, jt int conf soft comput intell syst, scis int symp adv intell syst, isis
        cristiano j, 2014, adv intell sys comput safa at, 2014, robotica
        omido t, 2014, int conf control autom rob vis, icarcv
        bazargan-lari y, 2014, lat am j solids struct
        stopforth r, 2014, adv intell sys comput
        ferreira jp, 2014, int j adv rob syst
        xie h, 2014, int conf logist, eng, manag comput sci, lemcs
        montano oe, 2014, ifac proc vol (ifac-papersonline)
        hobon m, 2014, rob autom syst chen lm, 2014, adv mater res
        miao z, 2014, chin j mech eng engl ed omran s, 2014, mob serv robot
        xiaoguang z, 2014, open autom control syst j
        geonea id, 2014, adv mater res
        calderon caa, 2014, int conf control autom rob vis, icarcv
        lee jh, 2014, artif life rob hamon a, 2014, multibody syst dyn
        efimov d, 2014, nonlinear anal hybrid syst
        luo y, 2014, proc int conf mach learn cybern
        rubio h, 2014, mech mach sci chen y, 2014, appl mech mater
        kuhlemann i, 2014, mob serv robot akdas d, 2014, acta polytech hung
        lim i-s, 2014, rob autom syst
        şafak kk, 2014, turk j electr eng comput sci
        wang g, 2014, control intell syst
        fayong g, 2014, ieee int conf robot biomimetics, ieee robio
        karssen jgd, 2014, robotica he b, 2014, robotica
        sukumaran s, 2014, procedia eng
        azimi m, 2014, asme int mech eng congress expos proc
        tran dt, 2014, int j control autom syst römer u, 2014, mob serv robot
        wu b, 2014, mob serv robot shahbazi h, 2014, robotica
        kim j-w, 2014, int j adv rob syst
        baltes j, 2014, ifac proc vol (ifac-papersonline)
        liu j, 2014, int conf control autom rob vis, icarcv
        liu xy, 2014, appl mech mater
        nimisha c, 2014, proc int conf circuits, commun, control comput, ic
        oviedo-barriga j, 2014, robotica mahmoodabadi mj, 2014, neurocomputing
        ogawa y, 2014, ifac proc vol (ifac-papersonline)
        masurkar k, 2014, int conf adv eng technol res, icaetr
        wu cw, 2014, appl mech mater chen gd, 2014, appl mech mater
        chen g, 2014, ifac proc vol (ifac-papersonline) fu c, 2014, robotica
        shibuya k, 2014, mob serv robot
        yamada t, 2014, lect notes eng comput sci li t, 2014, robotica
        owaki d, 2014, mob serv robot kim jh, 2014, multibody syst dyn
        raković m, 2014, mech mach sci carbone g, 2014, mech mach sci
        hashimoto k, 2014, mech mach sci dadashzadeh b, 2014, adv rob
        albitar h, 2014, mob serv robot
        jianghai z, 2014, ieee int conf mechatronics autom, ieee icma
        becker f, 2014, proc jt int symp rob, isr german conf rob, robotik
        mori k, 2014, electr eng jpn hu xc, 2014, appl mech mater
        wang z, 2014, chin control decis conf, ccdc
        shin h-k, 2014, ieee trans rob grizzle jw, 2014, automatica
        chen z, 2014, icinco - proc int conf informatics control, autom rob
        shafii n, 2014, ieee int conf auton robot syst compet, icarsc
        brooks g, 2014, chin control decis conf, ccdc
        klein ma, 2014, lect notes comput sci degani a, 2014, ieee trans rob
        sariyildiz e, 2014, ieee int conf mechatronics autom, ieee icma
        yeon js, 2014, ieee asme trans mechatron
        shen p, 2014, chin control decis conf, ccdc fukuoka y, 2014, robotica
        arouri w, 2014, res j appl sci eng technol
        fang j, 2014, med biol eng comput
        cacucciolo v, 2014, lect notes comput sci
        hereid a, 2014, hscc - proc int conf hybrid syst: comput control (part cps week)
        ferreira c, 2014, icinco - proc int conf informatics control, autom rob
        sajjad i, 2014, int conf rob emerging allied technol eng, icreate - proc
        aoi s, 2014, j rob mechatronics cui yf, 2014, appl mech mater
        li jl, 2014, appl mech mater
        teixeira c, 2014, ieee int conf auton robot syst compet, icarsc
        wang p, 2014, ieee int conf mechatronics autom, ieee icma
        fedele p, 2014, proc mediterr electrotech conf melecon
        farzadpour f, 2014, jvc/j vib control martin ae, 2014, int j rob res-a
        nerakae k, 2014, appl mech mater islam mn, 2014, ieee trans rob
        roy ss, 2014, j intell rob syst theor appl
        urbann o, 2014, lect notes comput sci petrič t, 2014, int j mech control
        ames ad, 2014, ieee trans autom control
        gregg rd, 2014, ieee trans control syst technol lin j, 2014, robotica
        virgala i, 2014, appl mech mater shao j, 2014, key eng mat
        ames ad, 2014, ieee trans autom control-a
        helbig t, 2014, lect notes comput sci
        hashlamon i, 2014, ieee int symp ind electron wang t, 2014, robotica
        li z, 2014, ieee int conf mechatronics autom, ieee icma
        alyahmedi as, 2014, proc iasted int conf rob appl, ra
        fang h, 2014, proc spie int soc opt eng hamed ka, 2014, ieee trans rob
        ferreira c, 2014, icinco - proc int conf informatics control, autom rob-a
        farzaneh y, 2014, appl soft comput j
        wang h, 2014, int j control autom syst
        li z, 2014, chin j mech eng engl ed li t, 2014, int j humanoid rob
        zhou x, 2014, int j humanoid rob chen x, 2014, robotica
        al-shuka hfn, 2014, robotica
        muscolo gg, 2014, proc mediterr electrotech conf melecon
        calisti m, 2014, lect notes comput sci deng x, 2014, bio-med mater eng
        hornung a, 2014, int j humanoid rob geng t, 2014, ieee trans rob
        park s-h, 2014, adv mater res iqbal s, 2014, rob autom syst
        chen s-c, 2014, ieee asme trans mechatron
        shunting s, 2014, proc - int symp comput, consum control, is3c
        matos v, 2014, rob autom syst segura c, 2014, adv mater res
        zhao h, 2014, proc am control conf
        govea e, 2014, ieee bienn congr argentina, argencon
        zhang k, 2014, chin control decis conf, ccdc
        fremerey m, 2014, lect notes comput sci
        park c-s, 2014, ieee asme trans mechatron tian y, 2014, mech mach theory
        al-shuka hfn, 2014, robotica-a qiu z, 2014, appl mech mater
        huai c, 2014, wit trans eng sci silva p, 2014, rob autom syst
        wang l, 2014, appl intell
        yorozu a, 2014, icinco - proc int conf informatics control, autom rob
        takahashi y, 2014, int workshop adv motion control amc
        hashlamon i, 2014, ieee int symp ind electron-a
        sun z, 2014, ieee int conf auton robot syst compet, icarsc
        yu zw, 2014, appl mech mater kherici n, 2014, j comput sci
        wang m, 2014, int j mech control lee b-j, 2014, j electr eng technol
        rai jk, 2014, isccsp - int symp commun, control signal process, proc
        liang z, 2014, ieee int conf mechatronics autom, ieee icma
        george bp, 2013, acm int conf proc ser
        zaidi a, 2013, int conf individ collect behav rob - proc icbr
        liu c, 2013, ieee trans syst man cybern pt a syst humans
        zhao j, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        oliveira m, 2013, aip conf proc
        wu x, 2013, ieee int conf mechatronics autom, ieee icma
        hwang sw, 2013, int symp rob, isr cui yf, 2013, appl mech mater
        yeon js, 2013, int symp rob, isr
        hashlamon i, 2013, asian control conf, ascc
        kurita k, 2013, proc - iiai int conf adv appl informatics, iiai-aai
        romero g, 2013, int j simul syst sci technol
        ito s, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        massah b a, 2013, j mech sci technol
        lee yk, 2013, proc ieee int workshop robot human interact commun
        nguyen tl, 2013, virtual phys prototyping majidi c, 2013, int j rob res
        chao ky-w, 2013, j chin soc mech eng trans chin inst eng ser c
        daya b, 2013, proc - int conf comput intell commun networks, cicn
        liu j, 2013, appl mech mater
        manoiu-olaru s, 2013, int conf syst theory, control comput, icstcc; jt conf sintes, saccs, simsis - proc
        tan x, 2013, biotechnol an indian j
        jing c, 2013, proc - int conf inf technol appl, ita
        huai cf, 2013, appl mech mater teixeira c, 2013, aip conf proc
        lee s, 2013, int j humanoid rob bakhsh q, 2013, appl mech mater
        liu j, 2013, appl mech mater-a
        hobon m, 2013, icinco - proc int conf informatics control, autom rob
        feng s, 2013, sci china inf sci
        semwal vb, 2013, care - ieee int conf control, autom, rob embedded syst, proc
        sung k-w, 2013, int symp rob, isr
        kamogawa y, 2013, int conf control, autom syst
        karunakaran kk, 2013, proc ieee annual northeast bioengineering conf, nebec
        hong s, 2014, ieee trans ind electron schmidt d, 2013, rob autom syst
        xu y, 2013, appl mech mater cui yf, 2013, appl mech mater-a
        lin x, 2013, kybernetika
        hicheur h, 2013, proc - hum assoc conf affective comput intelligent interact, acii
        ozel s, 2013, asian control conf, ascc
        kim dw, 2013, int conf control, autom syst
        ugurlu b, 2014, ieee trans ind electron
        zhang q, 2013, ieee int conf mechatronics autom, ieee icma
        kochuvila s, 2013, appl mech mater
        kryczka p, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        koo im, 2013, int j control autom syst
        sung k-w, 2013, int conf control, autom syst
        hashlamon i, 2013, asian control conf, ascc-a
        wang g, 2013, ieee int conf inf autom, icia
        ali f, 2013, int j adv rob syst xu l, 2013, int j adv rob syst
        bououden s, 2014, rob autom syst
        chafroud n, 2013, int conf individ collect behav rob - proc icbr
        aoustin y, 2013, rob autom syst hong y-d, 2014, ieee trans ind electron
        stopforth r, 2013, ieee eurocon luo ds, 2013, appl mech mater
        ghanbari a, 2013, adv mater res
        ibanez a, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        wu c-m, 2013, asian control conf, ascc
        hettich g, 2013, neurotechnix - proc int congr neurotechnology, electron informatics
        luo rc, 2013, iecon proc
        zhu h, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        rosa jr n, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        lee g, 2013, int symp rob, isr
        shin h, 2013, proc eccomas thematic conf multibody dyn
        geng t, 2014, ieee trans ind electron
        matus-vargas a, 2013, ieee int autumn meet power, electron comput, ropec
        li g, 2013, adv mater res xu l, 2013, j bionic eng
        fujiki s, 2013, auton robots qi kc, 2013, adv mater res
        van zutven p, 2013, int j adv rob syst miura k, 2013, ieee trans rob
        spröwitz a, 2013, int j rob res rai jk, 2013, int j rob autom
        dong w, 2013, appl mech mater sun j, 2013, adv mater res
        moattari m, 2013, conf ai rob robocup iran open int symp: learn, glorious future, rios
        nikolić m, 2013, int j humanoid rob
        shafii n, 2013, lect notes comput sci
        wang d, 2013, chin control decis conf, ccdc
        ding r, 2013, int j adv rob syst ammar b, 2013, lect notes comput sci
        morse g, 2013, gecco - proc genet evol comput conf
        zheng yf, 2013, ieee conf technol prac robot appl, tepra
        yuan l, 2013, appl mech mater wee t-c, 2013, int j adv rob syst
        hogan n, 2013, front comput neurosci xu ls, 2013, appl mech mater
        jo hs, 2013, int j autom comput
        hashlamon i, 2013, ieee int conf mechatronics, icm
        wang f, 2013, chinese control conf, ccc
        velasquez-lobo mf, 2013, int conf electron, commun comput, conielecomp
        satoh s, 2013, robotica urbann o, 2013, auton robots
        sun y, 2013, adv rob asano f, 2013, multibody syst dyn
        wang h, 2013, chin j mech eng engl ed wang z-j, 2013, inf technol j
        kim dw, 2013, lect notes electr eng vázquez ja, 2013, int j adv rob syst
        ouyang x, 2013, lect notes electr eng
        christensen dj, 2013, rob autom syst lu j-c, 2013, j bionic eng
        luo rc, 2013, int conf adv rob intelligent syst, aris - conf proc
        ding c-t, 2013, acta mech sin yu h, 2013, chin j mech eng engl ed
        wu x, 2013, int j adv rob syst
        mehr am, 2013, conf ai rob robocup iran open int symp: learn, glorious future, rios
        wu zj, 2013, appl mech mater kuo c-h, 2013, int j humanoid rob
        santos j, 2013, ieee congr evol comput, cec
        zaier r, 2013, int multi-conf syst, signals devices, ssd
        wang g, 2013, proc int conf comput sci educ, iccse
        imani b, 2013, int conf rob mechatronics, icrom
        dadashzadeh b, 2013, int j adv rob syst
        jiang y, 2013, proc ieee conf ind electron appl, iciea
        zhou x, 2013, robotica alcaraz-jiménez jj, 2013, int j rob res
        majewski t, 2013, int conf electron, commun comput, conielecomp
        hosseinipour m, 2013, proc spie int soc opt eng liu c, 2013, ind robot
        perrin n, 2013, adv rob sanz-merodio d, 2013, ind robot
        cho ju, 2013, proc iasted int conf model simul
        braun bc, 2013, appl mech mater sang l-f, 2013, int j autom comput
        saito k, 2013, proc iasted int conf model simul
        chen hl, 2013, adv mater res gregg rd, 2013, ieee trans autom control
        shahbazi h, 2013, int j adv rob syst
        aghaabbasloo m, 2013, conf ai rob robocup iran open int symp: learn, glorious future, rios
        sadigh mj, 2013, robotica fuente la, 2013, ieee congr evol comput, cec
        hashimoto k, 2013, adv rob torklarki sm, 2013, appl mech mater
        khadiv m, 2013, int conf rob mechatronics, icrom
        rynkevic r, 2013, port bioeng meet, enbeng - book proc
        kani mhh, 2013, int conf rob mechatronics, icrom
        mummolo c, 2013, robotica
        wu w, 2013, ieee/asme int conf adv intelligent mechatronics: mechatronics hum wellbeing, aim
        askari s, 2013, j rehabil res dev adiwahono ah, 2013, int j humanoid rob
        chen w-h, 2013, mech mach theory
        siles i, 2013, wseas transappl theor mech
        tavakoli a, 2013, nonlinear dyn kim b-h, 2013, int j adv rob syst
        liu x, 2013, proc am control conf
        hwang ks, 2013, ifac proc vol (ifac-papersonline)
        rynkevic r, 2013, proc iasted int conf model ident control
        liu c, 2013, robotica park i-w, 2013, appl mech mater
        ziegler m, 2013, lect notes comput sci
        narioka k, 2013, at-automatisierungstechnik
        caluwaerts k, 2013, artif life yu w, 2013, stud comput intell
        asaba k, 2013, proc sice annu conf van heerden k, 2013, ieej j ind appl
        la hera pxm, 2013, ieee trans rob
        wang h, 2013, ieee int conf mechatronics autom, ieee icma
        hwang k-s, 2013, proc sice annu conf kim j-h, 2013, int j adv rob syst
        aoi s, 2013, j r soc interface sun y, 2013, mechatronics
        boddiford a, 2013, proc asme des eng tech conf
        wang l, 2013, ieee trans syst man cybern syst
        amran ac, 2013, ieej j ind appl nolle l, 2013, mendel
        ferreira jp, 2013, ieee trans control syst technol
        jeon y, 2013, int j adv rob syst wang l, 2013, int j fuzzy syst
        bajrami xh, 2013, ifac proc vol (ifac-papersonline)
        wang l, 2013, eng appl artif intell
        destenhe m, 2013, int conf ubiquitous rob ambient intell, urai
        janardhan v, 2013, int natl conf mach mech, inacomm
        ferreira r, 2013, proc int conf auton rob syst, robotica
        chiang m-h, 2013, j bionic eng
        zang x, 2013, proc - int symp instrum meas, sens netw autom, imsna
        motoi n, 2013, j rob mechatronics kim i, 2013, int j adv rob syst
        owaki d, 2013, j r soc interface
        hengst b, 2013, nat-inspired mob rob: proc int conf climbing walking rob support technol mob mach, clawar
        yoshida a, 2013, proc sice annu conf yuan l, 2013, appl mech mater-a
        narang g, 2013, ieee/sice int symp syst integr, sii
        park h-w, 2013, ieee trans rob daut mn, 2013, commun comput info sci
        rong x, 2013, res j appl sci eng technol
        li y, 2013, proc int conf meas, inf control, icmic
        chen b-s, 2013, int j fuzzy syst liu w, 2013, int j adv rob syst
        shimmyo s, 2013, ieee trans ind electron
        wang l, 2013, int j fuzzy syst-a zhou m, 2013, lect notes comput sci
        yang w, 2013, int j adv rob syst ali f, 2013, ieej j ind appl
        hong y-d, 2013, ieee asme trans mechatron
        sreenath k, 2013, int j rob res wang z, 2013, sens rev
        wang l, 2013, ieee trans neural networks learn sys
        crespi a, 2013, ieee trans rob li t, 2013, front mech eng
        woo sj, 2013, adv intell sys comput ali f, 2013, j rob mechatronics
        xie h, 2013, appl mech mater
        chen s, 2013, ieee int conf rob biomimetics, robio-a
        cui y, 2013, prz elektrotech kim y-j, 2013, lect notes comput sci
        raj s, 2013, int natl conf mach mech, inacomm
        fujimoto s, 2013, int j adv mechatronic syst alba m, 2013, mech mach sci
        rushton sk, 2013, disp islam mn, 2013, proc am control conf
        wu n, 2013, ifac proc vol (ifac-papersonline)
        mate cz, 2013, mech mach sci ki ws, 2013, lect notes comput sci
        vázquez ja, 2013, j appl res technol
        ierache js, 2013, adv intell sys comput
        ke w-d, 2013, int j comput sci math
        hong y-d, 2013, adv intell sys comput mahmoodi p, 2013, appl math model
        tran dt, 2013, int conf ubiquitous rob ambient intell, urai
        guan y, 2013, ieee asme trans mechatron
        kim dw, 2012, lect notes comput sci
        ma j, 2012, field rob - proc int conf climbing walking rob support technol mob mach, clawar
        wu g, 2012, lect notes comput sci
        jia w, 2012, proc annu int conf ieee eng med biol soc embs
        ugurlu b, 2012, int j humanoid rob
        choi yl, 2012, int conf soft comput intelligent syst, int symp adv intell syst, scis/isis
        kwon sj, 2012, int j adv rob syst
        nada k, 2012, proc int conf complex syst, iccs
        li y, 2012, int conf indoor positioning indoor navig, ipin - conf proc
        yasin a, 2012, ieee int conf rob biomimetics, robio - conf dig
        luo rc, 2012, ieee int conf autom sci eng
        tesch m, 2012, ieee int symp saf, secur, rescue rob, ssrr
        chang d, 2013, j mech sci technol peyvandi a, 2013, j bionic eng
        ferreira jp, 2012, world autom congress proc
        zhao j, 2012, field rob - proc int conf climbing walking rob support technol mob mach, clawar
        yuan l, 2012, appl mech mater kuo c-h, 2013, ieee asme trans mechatron
        wu w, 2012, ieee int conf rob biomimetics, robio - conf dig
        rodic a, 2012, world autom congress proc
        dang d, 2012, ieee-ras int conf humanoid rob
        kolathaya s, 2012, ieee int symp saf, secur, rescue rob, ssrr
        war vp, 2012, iet conf publ
        macalpine p, 2012, proc adapt learn agents workshop, ala - held conjunction int conf auton agents multiagent syst, aamas
        low sm, 2012, commun comput info sci
        kang r, 2012, adv reconfigurable mech rob
        campos c, 2012, world autom congress proc
        alghooneh m, 2012, int j humanoid rob
        wu s, 2012, proc - int conf control eng commun technol, iccect
        duarte af, 2012, aip conf proc
        zhang x, 2012, proc - int symp comput intell des, iscid
        hopkins jk, 2012, perform metr intelligent syst (permis) workshop
        sreerag r, 2012, int conf adv comput, icoac
        xianming w, 2012, chinese control conf, ccc
        liu l, 2012, int j adv rob syst
        wang h, 2012, adv reconfigurable mech rob
        yamada k, 2012, int conf ubiquitous rob ambient intell, urai
        haq a, 2012, field rob - proc int conf climbing walking rob support technol mob mach, clawar
        sugihara t, 2012, ieee-ras int conf humanoid rob
        komizunai s, 2012, int j humanoid rob
        kenwright b, 2012, workshop procedural content gener games, pcg, organ conjunction found digit games conf, fdg
        xu l, 2012, int conf control, autom, rob vis, icarcv
        mummolo c, 2012, asme annu dyn syst control conf jt jsme motion vib conf, dscc-movic
        tu b, 2012, adv mater res
        choi n, 2012, int conf ubiquitous rob ambient intell, urai
        al-busaidi am, 2012, france-japan eur-asia congr mechatronics, mecatronics int workshop res educ mechatronics, rem
        yu b-h, 2012, proc int symp autom rob constr, isarc
        xue f, 2013, adv intell sys comput
        de paiva rc, 2012, proc world congr nature biol inspired comput, nabic
        wen l, 2013, int j adv rob syst
        ames ad, 2012, hscc - proc int conf hybrid syst: comput control, part cpsweek
        mufti s, 2012, int conf rob artif intell, icrai
        liang c, 2012, front mech eng owaki d, 2013, adv intell sys comput
        huang y, 2012, int j adv rob syst
        yazdani r, 2012, icee - iran conf electr eng
        pinto cma, 2012, j numer anal ind appl math jiang z, 2012, j comput
        kochuvila s, 2012, lect notes comput sci
        deng k, 2012, ieee int conf mechatronics autom, icma
        tsai c-s, 2012, appl mech mater vukobratović m, 2012, int j adv rob syst
        bauer jm, 2012, eccomas - eur congr comput methods appl sci eng, e-book full pap
        hernández-santos c, 2012, int j adv rob syst
        zhang p, 2012, adv mater res xu t, 2012, chin j mech eng engl ed
        li t-hs, 2012, ieee trans ind electron kim b-h, 2012, int j adv rob syst
        matos v, 2012, icinco - proc int conf informatics control, autom rob
        kuroda s, 2012, lect notes comput sci aftab z, 2012, j biomech
        sung k-w, 2012, int conf control, autom syst
        shih c-l, 2012, int j adv rob syst shieh m-y, 2012, comput math appl
        xue f, 2012, lect notes comput sci ferreira jp, 2012, int j humanoid rob
        sasi rekha lathan l, 2012, ieee-int conf adv eng, sci manage, icaesm
        wang f, 2012, proc chin control decis conf, ccdc
        miao k, 2012, iccse - proc int conf comput sci educ
        bi s, 2012, lect notes comput sci wang l, 2012, int j precis eng manuf
        singh spn, 2012, robotica
        lee h-w, 2012, conf proc ieee int conf syst man cybern
        al-busaidi am, 2012, lect notes comput sci wong c-c, 2012, adv sci lett
        liu g, 2012, ieee int conf mechatronics autom, icma
        kang r, 2012, comput math appl kuyucu t, 2012, memetic comput
        kim j, 2012, conf proc ieee int conf syst man cybern
        li r, 2012, lect notes comput sci
        yasin a, 2012, ieee int conf mechatronics autom, icma
        zoltan mc, 2012, appl mech mater chen s, 2012, int j adv rob syst
        torres e, 2012, lect notes comput sci
        yuan l, 2012, proc - int conf digit manuf autom, icdma
        wang x, 2012, j bionic eng locascio ma, 2012, adapt behav
        zhao j, 2012, ieee int conf mechatronics autom, icma
        hu x, 2012, lect notes comput sci zhang d, 2012, appl mech mater
        zhou x, 2012, adv mater res
        valdivia chg, 2012, proc - int conf intelligent environ, ie
        kim j, 2012, conf proc ieee int conf syst man cybern-a
        cao k, 2012, ieee int conf mechatronics autom, icma
        yasin a, 2012, ieee int conf inf autom, icia
        bhatti z, 2012, proc - vrcai: acm siggraph int conf virtual-real continuum its appl ind
        sorin m-o, 2012, ieee int conf autom, qual test, rob, aqtr - proc
        kim y-j, 2012, ieee int conf inf autom, icia
        silva p, 2012, lect notes comput sci asif u, 2012, int j adv rob syst
        koolen t, 2012, int j rob res
        uchitomi h, 2012, icme int conf complex med eng, cme proc
        seven u, 2012, soft comput
        rokbani n, 2012, int conf educ e-learn innov, iceeli
        tang c, 2012, proc world congr intelligent control autom wcica
        shih c-l, 2012, int j adv rob syst-a zhou x, 2012, adv mater res-a
        alitavoli m, 2012, inista - int symp innovations intelligent syst appl
        pratt j, 2012, int j rob res liu c, 2012, j mech robot
        shih c-l, 2012, robotica ankarali a, 2012, int j adv rob syst
        wang t, 2012, rob autom syst wendel e, 2012, nonlinear anal hybrid syst
        chen z, 2012, int j smart nano mater
        van heerden k, 2012, int workshop adv motion control amc
        bertrand s, 2012, mech mach theory
        zarrouk d, 2012, ieee trans biomed eng
        hu k, 2012, ifac proc vol (ifac-papersonline)
        zhou c, 2012, ieee asme trans mechatron wang c-k, 2012, adv sci lett
        sun y, 2012, ifac proc vol (ifac-papersonline)
        farzadpour f, 2012, adv mater res
        dezfouli s, 2012, proc asme des eng tech conf cai y, 2012, adv rob
        shamsudin hc, 2012, j theor appl inf technol
        zhang l, 2012, appl bionics biomech li w, 2012, sci china technol sci
        ge ss, 2012, ieee trans control syst technol
        zhang q, 2012, energy procedia gregg rd, 2012, ieee trans rob
        nerakae k, 2012, int conf model appl simul, mas, held int multidiscip model simul multiconference, i3m
        suzuki m, 2012, proc sice annu conf shahbazi h, 2012, ind robot
        wei h, 2012, adv mater res aoi s, 2012, ieee trans rob
        jeon y, 2012, proc sice annu conf yoshida a, 2012, proc sice annu conf
        chang m-k, 2012, icic express lett chen c-y, 2012, struct eng mech
        larsen j, 2012, adapt mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        hamed ka, 2012, ieee trans syst man cybern pt a syst humans
        baca j, 2012, rob autom syst
        shaikh iuh, 2012, proc int bhurban conf appl sci technol, ibcast
        arous y, 2012, proc mediterr electrotech conf melecon
        yussof h, 2012, procedia eng rajendra r, 2012, adv intell soft comput
        jones ms, 2012, adapt mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        braun dj, 2012, ieee asme trans mechatron ugurlu b, 2012, ieee trans rob
        dobra a, 2012, adv mater res kato h, 2012, proc sice annu conf
        rai jk, 2012, icpces - int conf power, control embedded syst
        doubliez p-f, 2012, int j humanoid rob
        yilmaz m, 2012, int workshop adv motion control amc
        hashemi e, 2012, adv struct mater zoltan mc, 2012, adv mater res
        azmi adly m, 2012, aust j basic appl sci
        bi s-s, 2012, proc inst mech eng part k j multi-body dyn
        kaneko k, 2012, int workshop adv motion control amc
        santos cp, 2012, rob autom syst xu y, 2012, adv mater res
        or j, 2012, ieee trans syst man cybern pt c appl rev
        wang h, 2012, lect notes electr eng tsai c-s, 2012, icic express lett
        wu b, 2012, int j rob autom shah sv, 2012, mech mach theory
        zhao j, 2012, chin sci bull
        wang s, 2012, ieee trans syst man cybern pt c appl rev
        wang t, 2012, j bionic eng
        geissmann l, 2012, field rob - proc int conf climbing walking rob support technol mob mach, clawar
        souissi m, 2012, proc mediterr electrotech conf melecon
        hernández-santos c, 2012, proc asme des eng tech conf
        ames ad, 2012, hscc - proc acm int conf hybrid syst: comput control
        neves c, 2012, adapt mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        baydin ag, 2012, paladyn luo x, 2012, j bionic eng
        hanazawa y, 2012, ifac proc vol (ifac-papersonline)
        santos j, 2012, neurocomputing klaus g, 2012, lect notes comput sci
        hashemi e, 2012, proc annu southeast symp syst theory
        grimes ja, 2012, adapt mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        asano f, 2012, adv rob bouyarmane k, 2012, adv rob
        wait kw, 2011, proc ieee int conf rob autom
        zhu m, 2011, proc - int conf intelligent inf hiding multimedia signal process, iihmsp
        kim dw, 2012, nonlinear dyn
        iima h, 2011, conf proc ieee int conf syst man cybern
        sorin m-o, 2012, ifac proc vol (ifac-papersonline)
        al yahmadi as, 2012, int j veh noise vib
        zhu m, 2011, proc - int conf intelligent inf hiding multimedia signal process, iihmsp-a
        morales do, 2012, proc ieee int conf rob autom
        harata y, 2012, nonlinear dyn
        wang h, 2011, ieee int conf intell rob syst
        zhong q-b, 2011, j harbin inst technol meriçli c, 2012, auton robots
        gritli h, 2012, comm nonlinear sci numer simul
        guan y, 2011, ieee int conf intell rob syst
        alghooneh m, 2012, int j smart sensing intelligent syst
        chuang c-h, 2012, smart struct syst escobar me, 2012, j appl res technol
        yasin a, 2011, lect notes electr eng shahbazi h, 2012, appl mech mater
        matsubara t, 2012, proc ieee int conf rob autom
        kalveram kt, 2012, biol cybern xu l, 2012, appl mech mater
        firmani f, 2012, robotica
        liu z, 2012, ieee trans syst man cybern pt c appl rev
        aoyama t, 2012, j rob mechatronics aoyama t, 2012, j rob mechatronics-a
        xu c, 2012, proc ieee int conf rob autom
        mirbagheri mm, 2011, proc annu int conf ieee eng med biol soc embs
        chai f-j, 2011, j harbin inst technol
        seung h, 2011, urai - int conf ubiquitous rob ambient intell
        tani k, 2012, lect notes eng comput sci
        gritli h, 2012, int j bifurcation chaos
        miyazaki k, 2012, j adv comput intell intelligent informatics
        kalamian n, 2011, int econf comput knowl eng, iccke
        xing d, 2011, conf proc ieee int conf syst man cybern
        mummolo c, 2011, proc asme des eng tech conf
        liu c, 2012, chin j mech eng engl ed
        yuksel b, 2011, proc int symp artif life rob, arob
        li h, 2011, proc - int conf intelligent inf hiding multimedia signal process, iihmsp
        kuroda s, 2012, j adv comput intell intelligent informatics
        gritli h, 2012, int j bifurcation chaos-a dai q, 2011, procedia eng
        yokomichi t, 2012, j rob mechatronics
        sinnet rw, 2012, j rob mechatronics park jh, 2011, j mech sci technol
        hanazawa y, 2012, j rob mechatronics
        muscolo gg, 2011, ieee-ras int conf humanoid rob
        yazdi e, 2011, ieee int conf autom logist, ical
        cardenas-maciel sl, 2011, appl soft comput j
        wang l-y, 2011, proc chin control conf, ccc meneses j, 2011, stroj vest
        pinto cma, 2011, aip conf proc
        wu s, 2011, proc int conf digit manuf autom, icdma
        dang d, 2011, ieee-ras int conf humanoid rob
        dian s, 2011, ieee int conf mechatronics autom, icma
        kamegawa t, 2011, ieee int symp saf, secur, rescue rob, ssrr
        shamsuddin s, 2011, proc - ieee int conf control syst, comput eng, iccsce
        david a, 2011, multibody syst dyn
        wang l-y, 2011, proc chin control conf, ccc-a
        wang z, 2011, inf technol j song g-c, 2011, j harbin inst technol-a
        hernández-santos c, 2011, proc - ieee electron, rob autom mech conf, cerma
        mate cz, 2011, rom rev precis mech opt mechatronics
        kumar rp, 2011, robotica
        shafii n, 2011, proc iberian conf inf syst technol, cisti
        akhtaruzzaman m, 2011, natl postgrad conf - energy sustainability: explor innov minds, npc
        falotico e, 2011, ieee-ras int conf humanoid rob
        lapeyre m, 2011, ieee-ras int conf humanoid rob
        luo rc, 2011, ieee asme int conf adv intellig mechatron aim
        omer a, 2011, ieee/sice int symp syst integr, sii
        wu h-m, 2011, ieee int conf fuzzy syst
        lópez am, 2011, lect notes comput sci
        mayr j, 2011, lect notes comput sci degallier s, 2011, auton robots
        liu m, 2011, adv mater res yamada k, 2011, int conf control, autom syst
        liu c, 2011, proc chin control conf, ccc
        wang f, 2011, ieee int conf mechatronics autom, icma
        kubisch m, 2011, ncta - proc int conf neural comput theory appl
        khunnithiwarawat t, 2011, ieee int conf rob biomimetics, robio
        harata y, 2011, robotica kormushev p, 2011, cybern inf technol
        luo rc, 2011, ieee int conf rob biomimetics, robio
        fukui f, 2011, ieej trans ind appl
        akhtaruzzaman m, 2011, urai - int conf ubiquitous rob ambient intell
        yu w, 2011, ncta - proc int conf neural comput theory appl
        dong h, 2011, lect notes comput sci melo k, 2011, lect notes electr eng
        gritli h, 2011, int conf commun, comput control appl, ccca
        sudheer ap, 2011, int j simul model
        liu d, 2011, proc chin control conf, ccc
        cho y-k, 2011, int conf control, autom syst
        ziqiang p, 2011, lect notes electr eng
        tu k-y, 2011, rose - ieee int symp rob sensors environ, proc
        sun f, 2011, proc int conf electron mech eng inf technol, emeit
        mayyas m, 2011, proc spie int soc opt eng
        mukherjee s, 2011, proc - acis int conf softw eng, artif intell networking parallel distrib comput, snpd
        zuo g, 2011, ieee int conf mechatronics autom, icma
        perkins ad, 2011, robotica zielinska t, 2011, robotica
        katoh k, 2011, proc - int conf biomed eng informatics, bmei
        jiang z, 2011, int conf appl inf commun technol, aict
        uchitane t, 2011, ieee congr evol comput, cec luo x, 2011, j bionic eng
        akhtaruzzaman m, 2011, int conf mechatronics: integr eng ind soc dev, icom - conf proc
        li j, 2011, robotica wang h, 2011, adv mater res
        moored kw, 2011, mar technol soc j lauder gv, 2011, mar technol soc j
        seven u, 2011, ieee int conf mechatronics, icm - proc
        sreenath k, 2011, int j rob res
        primerano r, 2011, ieee trans autom sci eng
        meriçli ç, 2011, lect notes comput sci kato n, 2011, mar technol soc j
        hu y, 2011, automatica
        gritli h, 2011, ieee int conf mechatronics, icm - proc
        piao s, 2011, appl mech mater asta s, 2011, lect notes comput sci
        lee y-k, 2011, int j precis eng manuf
        zhang z, 2011, proc - int conf meas technol mechatronics autom, icmtma
        gupta gs, 2011, conf rec ieee instrum meas technol conf
        asano f, 2011, robotica ali f, 2011, int j mech mech eng
        leines mt, 2011, proc ieee conf ind electron appl, iciea
        chia p-c, 2011, proc int conf syst sci eng, icsse
        kim j-h, 2011, auton robots
        tang q, 2011, proc - workshop digit media digit content manage, dmdcm
        wang y, 2011, proc - int conf meas technol mechatronics autom, icmtma
        dehghani r, 2011, proc inst mech eng part i j syst control eng
        liu z, 2011, proc - int conf meas technol mechatronics autom, icmtma
        liu cg, 2011, sci china inf sci
        akhtaruzzaman m, 2011, int conf mechatronics: integr eng ind soc dev, icom - conf proc-a
        mori y, 2011, ind robot wang c, 2011, int j innov comput inf control
        guo q, 2011, robotica taji k, 2011, robotica boutin l, 2011, robotica
        yokomichi t, 2011, proc iasted int conf rob appl, ra
        vallejos p, 2011, j intell rob syst theor appl
        sato t, 2011, ieee trans ind electron kim jh, 2011, mech mach theory
        hauser h, 2011, biol cybern
        bagheri a, 2011, inista - int symp innovations intelligent syst appl
        iba d, 2011, proc spie int soc opt eng
        testart j, 2011, j intell rob syst theor appl
        tlalolini d, 2011, ieee asme trans mechatron
        khorsandi mt, 2011, inista - int symp innovations intelligent syst appl
        yussof h, 2011, int j adv rob syst
        suwanratchatamanee k, 2011, ieee trans ind electron
        muecke k, 2011, intelligent serv rob hugel v, 2011, ieee trans rob
        you z, 2011, ieee int conf inf autom, icia
        kawamura a, 2011, ieee int conf mechatronics, icm - proc
        akhtaruzzaman m, 2011, int conf mechatronics: integr eng ind soc dev, icom - conf proc-a-b
        li t-hs, 2011, ieee trans syst man cybern part b cybern
        chiang td, 2011, int solid-state sensors, actuators microsystems conf, transducers
        liu d, 2011, adv mater res shafii n, 2011, lect notes comput sci
        wang f, 2011, proc ieee conf ind electron appl, iciea
        yussof h, 2011, int j adv rob syst-a
        rittase w, 2011, proc iasted int conf rob appl, ra
        ferreira jp, 2011, robotica
        wang f, 2011, proc chin control decis conf, ccdc
        oliveira m, 2011, lect notes comput sci
        an k, 2011, zhongnan daxue xuebao (ziran kexue ban)
        mondal s, 2011, commun comput info sci
        erbatur k, 2011, turk j electr eng comput sci
        santos cp, 2011, rob autom syst cho b-k, 2011, adv rob
        wang x, 2011, inf technol j
        moghaddam mm, 2011, j intell mater syst struct
        kim j-y, 2011, int j humanoid rob madani k, 2011, neurocomputing
        wu xg, 2011, appl mech mater
        nilas p, 2011, imecs - int multiconference eng comput scientists
        trojnacki mt, 2011, acta bioeng biomech piao s, 2011, adv mater res
        kima j-h, 2011, adv rob hatton rl, 2011, int j rob res
        vundavilli pr, 2011, sadhana xu ls, 2011, adv mater res
        manchester ir, 2011, int j rob res
        vundavilli pr, 2011, rob comput integr manuf
        radkhah k, 2011, int j humanoid rob
        fujimoto y, 2011, ieee int conf mechatronics, icm - proc
        wang t, 2011, rob autom syst sato t, 2011, ieej trans ind appl
        ames ad, 2011, hscc - proc acm/sigbed hybrid syst: comput control
        sun y, 2011, proc iasted int conf control appl, ca
        bîzdoacǎ ng, 2010, icinco - proc int conf informatics control, autom rob
        cupec r, 2011, rob autom syst choij h-s, 2011, robotica
        veinguertener a, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        rai jk, 2011, int j mechatronics manuf syst hu y, 2011, ieee trans rob
        sinnet rw, 2011, ifac proc vol (ifac-papersonline)
        zico kolter j, 2011, int j rob res
        sato t, 2011, ieee trans ind electron-a dong h, 2011, auton robots
        piao s, 2011, chin j electron hénaff p, 2011, control eng pract
        hashimoto k, 2011, adv rob jaleel a, 2011, natl conf mach mech, nacomm
        kwon h-j, 2011, j mech sci technol tadesse y, 2011, j mech robot
        aoi s, 2011, auton robots campos c, 2011, int rev model stimul
        mal j, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        baker bc, 2010, proc iasted int conf rob appl
        ankarali mm, 2011, auton robots liu c-h, 2010, lect notes comput sci
        ziv n, 2010, icinco - proc int conf informatics control, autom rob
        shen y-d, 2011, appl mech mater
        gökçe b, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        perkins ad, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        wang zf, 2011, sci china inf sci yuksel b, 2011, artif life rob
        pinto cma, 2011, comm nonlinear sci numer simul
        yazdi e, 2010, proc int conf artif intell, icai
        dallali h, 2010, iet semin dig fang y, 2010, lect notes comput sci
        daǧhan nm, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        nakai j, 2010, proc int symp artif life rob, arob
        zhao j, 2011, appl mech mater kim j-j, 2011, proc sice annu conf
        lebastard v, 2011, ieee trans rob
        kubisch m, 2011, int jt conf comput intell
        bavani am, 2011, proc - int conf control, instrum autom, iccia
        nagy l, 2010, proc epe-pemc - int power electron motion control conf
        wang q, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        kalakrishnan m, 2011, int j rob res
        babković k, 2010, siisy - ieee int symp intelligent syst informatics
        aghabalaie p, 2010, ieee int symp ind electron
        huang y, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        suleiman w, 2011, adv rob srinivasan m, 2011, j r soc interface
        gong x, 2010, proc chin control conf, ccc
        yamashita a, 2011, int j autom technol
        singh spn, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        chen s, 2010, proc int symp artif life rob, arob
        miyamoto h, 2010, mob rob: solutions challenges - proc int conf climbing walking rob support technol mob mach, clawar
        lozano a, 2011, proc int symp autom rob constr, isarc
        hobon m, 2011, ifac proc vol (ifac-papersonline)
        toh ck, 2010, lect notes comput sci saif sm, 2011, eur j sci res
        radkhah k, 2010, lect notes comput sci
        karimi a, 2011, proc - int conf control, instrum autom, iccia
        li t, 2011, ifac proc vol (ifac-papersonline)
        van zutven p, 2010, lect notes comput sci
        yu w, 2011, int jt conf comput intell
        lim h-o, 2010, iccas - int conf control, autom syst
        ko dh, 2010, iccas - int conf control, autom syst
        li j, 2010, ieee int conf rob biomimetics, robio
        liu c, 2010, proc iasted int conf rob, robo
        kim jh, 2010, ieee-ras int conf humanoid rob, humanoids
        tsai c-h, 2010, ieem - ieee int conf ind eng eng manage
        kim j-y, 2010, int j humanoid rob
        fatehi n, 2010, int conf control, autom, rob vis, icarcv
        ferreira jp, 2010, world autom congr, wac
        cuevas e, 2010, int j rob autom tu k-y, 2010, int j humanoid rob
        kouchaki e, 2010, ieee int conf rob biomimetics, robio
        koncsol j, 2010, ieee-ras int conf humanoid rob, humanoids
        tsai c-s, 2010, iccas - int conf control, autom syst
        cao y, 2010, proc ieee int conf inf theory inf secur, icitis
        amran ac, 2010, iccas - int conf control, autom syst
        höfer s, 2010, icfc icnc - proc int conf fuzzy comput int conf neural comput
        rai jk, 2010, int conf ind electron, control rob, iecr
        dehghani r, 2010, int j humanoid rob
        shin hk, 2010, iccas - int conf control, autom syst
        welihinda sm, 2010, proc int conf inf autom sustainability, iciafs
        zhou x, 2010, ieee int conf rob biomimetics, robio
        azmi adly m, 2010, int conf intelligent adv syst, icias
        akhtaruzzaman md, 2010, iccas - int conf control, autom syst
        mitobe k, 2010, world autom congr, wac
        kim b-s, 2010, iccas - int conf control, autom syst
        rokbani n, 2010, conf proc ieee int conf syst man cybern
        ali f, 2010, iccas - int conf control, autom syst
        fatehi n, 2010, iccas - int conf control, autom syst
        ferreira jp, 2010, ieem - ieee int conf ind eng eng manage
        forouzantabar a, 2010, world acad sci eng technol
        alba m, 2010, mech mach theory
        liu z, 2010, int conf mech autom control eng, mace
        goulding jr, 2010, ieee int conf multisensor fusion integr intell syst
        wang jc, 2010, proc world congr intelligent control autom wcica
        bessonnet g, 2010, robotica saadati h, 2010, ifmbe proc
        pratt je, 2010, proc spie int soc opt eng flynn ll, 2010, ieee trans rob
        wickrath m, 2010, commun comput info sci
        wang l, 2010, ieee int conf inf autom, icia
        mergner t, 2010, annu rev control
        wang h, 2010, proc ieee/asme int conf mechatronic embedded syst appl, mesa
        xiang y, 2010, proc int conf networking distrib comput, icndc
        zhang l, 2010, ieee conf rob autom mechatronics, ram
        la hera px, 2010, proc ieee int conf rob autom
        liu z, 2010, chin control decis conf, ccdc
        palma-amestoy r, 2010, int j humanoid rob
        zhu z-b, 2010, j harbin inst technol
        peng s, 2010, int conf intelligent comput technol autom, icicta
        hurst jw, 2010, ieee trans rob yu-te s, 2010, commun comput info sci
        handelman da, 2010, proc spie int soc opt eng
        xing dp, 2010, sci china ser f inf sci
        tzuu-hseng s l, 2010, commun comput info sci kim j-y, 2010, adv rob
        suraj h, 2010, icetc - int conf educ technol comput
        paterega yi, 2010, perspect technol methods mems des, memstech - proc int conf
        hyodo k, 2010, j rob mechatronics
        mu d, 2010, ieee int conf mechatronics autom, icma zhu c, 2010, adv rob
        suyi l, 2010, appl mech mater
        yu g, 2010, car - int asia conf informatics control, autom rob
        xu w, 2010, proc int conf networking distrib comput, icndc
        hou z, 2010, chin control decis conf, ccdc
        kim e-s, 2010, int j control autom syst
        nagasue j, 2010, icic express lett
        tian b, 2010, ieee conf rob autom mechatronics, ram
        serhan h, 2010, int j neural syst
        chen h, 2010, proc int conf networking distrib comput, icndc
        schröder-schetelig j, 2010, auton robots
        wang h, 2010, j harbin inst technol ke w-d, 2010, j harbin inst technol
        harada k, 2010, ieee asme trans mechatron addi k, 2010, math biosci eng
        li g, 2010, proc world congr intelligent control autom wcica
        zhao x, 2010, chin control decis conf, ccdc
        parsa m, 2010, proc - iran conf electr eng, icee
        pa p-s, 2010, adv mater res nakai j, 2010, artif life rob
        xie h-l, 2010, proc - int conf biomed eng inf, bmei
        ito s, 2010, eng appl artif intell
        wang f, 2010, chin control decis conf, ccdc
        qizhi z, 2010, ieee conf rob autom mechatronics, ram
        zhankui s, 2010, icacte - int conf adv comput theory eng, proc
        sato t, 2010, ieej trans ind appl
        zhang g, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        michaud f, 2010, mechatronics hu y, 2010, robotica
        vatau s, 2010, diffus def data pt b sato t, 2010, ieej trans ind appl-a
        thueer t, 2010, rob autom syst niimi h, 2010, proc sice annu conf
        park s, 2010, int j adv rob syst luneckas t, 2010, diffus def data pt b
        kato y, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        gasparetto a, 2010, appl bionics biomech
        shafii n, 2010, lect notes comput sci
        zielinska t, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        motoi n, 2010, ieej trans ind appl
        aoyama t, 2010, int j mechatronics manuf syst
        geng t, 2010, ieee asme trans mechatron
        shimmyo s, 2010, ieej trans ind appl or j, 2010, neural netw
        nagase k, 2010, ieej trans ind appl
        hu y, 2010, proc ieee conf decis control
        ghiasi ar, 2010, multibody syst dyn
        kano t, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        yilmaz m, 2010, ifac proc vol (ifac-papersonline)
        kaede k, 2010, j mech sci technol
        ali f, 2010, int conf control, autom, rob vis, icarcv
        kinugasa t, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        wahl t, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        yamashita t, 2010, proc sice annu conf
        freidovich lb, 2010, ifac proc vol (ifac-papersonline)
        kim m-s, 2010, j adv comput intell intelligent informatics
        zhong q, 2010, chin j electron
        chunqian f, 2010, int j intell syst technol appl
        iwatsuki k, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        vundavilli pr, 2010, rob autom syst
        uchitane t, 2010, proc sice annu conf
        huang q, 2010, int j innov comput inf control
        ishida m, 2010, ieej trans electron inf syst
        jeon y, 2010, proc sice annu conf inomata k, 2010, ieej trans ind appl
        jeong s, 2010, sens actuators a phys
        park c-s, 2010, int j control autom syst pinto cma, 2010, nonlinear dyn
        liu t, 2010, j mech robot
        honjo t, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        sugiura h, 2010, int j humanoid rob kim j-y, 2010, int j humanoid rob-a
        ito m, 2010, ieej trans ind appl huang t-y, 2010, proc sice annu conf
        suwanratchatamanee k, 2010, iccas - int conf control, autom syst
        cobano ja, 2010, auton robots vempaty pk, 2010, eng lett
        yazdekhasti s, 2010, int conf comput autom eng, iccae
        takai h, 2010, proc sice annu conf smith ja, 2010, int j rob res
        arbulu m, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        wang q, 2010, robotica tazaki y, 2010, rob autom syst
        mukovskiy a, 2010, ieee-ras int conf humanoid rob, humanoids
        owaki d, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        date h, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        ottaviano e, 2010, mech based des struct mach
        kim m-s, 2010, int j humanoid rob iida f, 2010, auton robots
        gregg rd, 2010, int j rob res shimmyo s, 2010, ieej trans ind appl-a
        li c, 2010, exp mech garcía jf, 2010, j phys agents
        fernández r, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        yamada m, 2010, emerg trends mob robot - proc of the 13th int conf on climbing and walk robot and the support technol for mob mach
        sekiguchi a, 2010, proc sice annu conf mombaur k, 2010, adv rob
        kao p-c, 2010, j biomech
        bongard jc, 2009, proc annu genetic evol comput conf, gecco
        tlalolini d, 2010, multibody syst dyn
        li x, 2009, ieee int conf rob biomimetics, robio
        braun dj, 2009, ieee/rsj int conf intelligent rob syst, iros
        trifonov k, 2009, int j multimedia ubiquitous eng
        uemura m, 2009, ieee/rsj int conf intelligent rob syst, iros
        li f, 2009, int conf bioinformatics biomed eng, icbbe
        ferreira jp, 2009, ieee/rsj int conf intelligent rob syst, iros
        quaglia g, 2010, int j rob res jalal a, 2009, lect notes comput sci
        xie h, 2009, int conf bioinformatics biomed eng, icbbe
        font jm, 2009, proc eucomes - eur conf mech sci
        son bg, 2009, ieee int conf rob biomimetics, robio
        tang j, 2009, int j adv rob syst
        iqbal j, 2009, int conf emerg technol, icet
        rai jk, 2009, proc iasted int conf rob appl cupec r, 2009, autom
        kwon y-d, 2009, proc spie int soc opt eng
        lin c-m, 2009, stud comput intell omer amm, 2009, lect notes electr eng
        renjewski d, 2009, ieee int conf rob biomimetics, robio
        ben-tzvi p, 2009, ieee/rsj int conf intelligent rob syst, iros
        helbo j, 2009, commun comput info sci
        kim jh, 2009, proc asme des eng tech conf
        zielinska t, 2009, proc eucomes - eur conf mech sci
        wang z-h, 2009, j cent south univ technol eng ed
        lim h-o, 2009, iccas-sice - icros-sice int jt conf, proc
        transeth aa, 2009, robotica
        qi z, 2009, proc asme/iftomm int conf reconfigurable mech rob, remar
        hyon s-h, 2009, ieee asme trans mechatron
        allemand y, 2009, ieee int conf rehabil rob, icorr
        gonzález hernández v, 2009, int conf electr eng, comput sci autom control, cce
        moosavian saa, 2009, int j humanoid rob
        kato h, 2009, iccas-sice - icros-sice int jt conf, proc
        el yaaqoubi nl, 2009, ieee-ras int conf humanoid robots, humanoids
        aoyama t, 2009, ieee asme trans mechatron
        ferreira jp, 2009, int conf adv rob, icar
        marco c, 2009, ieee asme int conf adv intellig mechatron aim
        tu k-y, 2009, lect notes comput sci
        he d, 2009, icinco - int conf informatics control, autom rob, proc
        aclan mc, 2009, ieee reg 10 annu int conf proc tencon
        cho b-k, 2009, int j humanoid rob
        kunimatsu s, 2009, iccas-sice - icros-sice int jt conf, proc
        braun dj, 2009, ieee-ras int conf humanoid robots, humanoids
        karungaru s, 2009, iccas-sice - icros-sice int jt conf, proc
        zaher aa, 2009, wseas trans syst control braun dj, 2009, ieee trans rob
        nakayama h, 2009, iccas-sice - icros-sice int jt conf, proc
        li x, 2009, proc chin conf pattern recogn, ccpr, cjk jt workshop pattern recogn, cjkpr
        daxu z, 2009, proc int conf model simul, icms
        lohmeier s, 2009, ieee asme trans mechatron
        tang y, 2009, int conf inf comput sci, icic
        nagai y, 2009, ieee int conf dev learn, icdl
        ferreira jp, 2009, int conf adv rob, icar-a harata y, 2009, robotica
        yu s, 2009, int ieee conf inf autom, icia
        kappaganthu k, 2009, int j humanoid rob
        ferreira jp, 2009, ieee trans neural networks
        yazdekhasti s, 2009, int conf comput electr eng, iccee
        sangwan v, 2009, ieee asme trans mechatron
        rezaul hasan sm, 2009, artif life rob
        yu z, 2009, int ieee conf inf autom, icia
        crawford al, 2009, proc asme int des eng tech conf comput inf eng conf, detc
        heiraty p, 2009, icinco - int conf informatics control, autom rob, proc
        ishida m, 2009, conf proc ieee int conf syst man cybern
        shafii n, 2009, proc ieee int conf autom logist, ical
        corpuz fjo, 2009, ieee reg 10 annu int conf proc tencon
        liu c, 2009, chin control decis conf, ccdc
        kim jh, 2009, proc asme int des eng tech conf comput inf eng conf, detc
        huang w, 2009, int j humanoid rob
        liu c, 2009, conf proc ieee int conf syst man cybern
        za'balawi ii, 2009, int j rob autom shimizu s, 2009, ieej trans ind appl
        ferreira jp, 2009, int conf adv rob, icar-a-b
        kuo c-h, 2009, lect notes comput sci kim e, 2009, lect notes comput sci
        chao f, 2009, proc iasted int conf artif intell appl, aia
        erbatur k, 2009, world acad sci eng technol schempf h, 2009, adv rob
        peterka rj, 2009, j physiol paris
        morris b, 2009, ieee trans autom control lee j, 2009, int j humanoid rob
        mämpel j, 2009, icara - proc int conf auton rob agents
        de santos pg, 2009, adv rob vukobratović m, 2009, int j humanoid rob
        dong h, 2009, rob autom syst xie h, 2009, j bioact compat polym
        goswami d, 2009, ieee trans rob hirose s, 2009, ieee rob autom mag
        ferreira jp, 2009, ieee trans instrum meas dip g, 2009, robotica
        ohashi e, 2009, ieej trans ind appl abdallah me, 2009, robotica
        hirano la, 2009, icara - proc int conf auton rob agents
        zhang h, 2009, ieee int conf mechatronics, icm asano f, 2009, robotica
        poulakakis i, 2009, ieee trans autom control zhang h, 2009, adv rob
        zhang s, 2009, proc spie int soc opt eng tesch m, 2009, adv rob
        wong c-c, 2009, tamkang j sci eng
        ohashi e, 2009, ieee trans ind electron
        omer amm, 2009, icara - proc int conf auton rob agents
        jaeggli t, 2009, int j comput vision
        kim j-y, 2009, j intell rob syst theor appl
        yoshida e, 2009, comput anim virtual worlds
        fasih a, 2009, int j comput intell syst
        yang w, 2009, int j control autom syst mergner t, 2009, j physiol paris
        czarnetzki s, 2009, rob autom syst ye c, 2009, adv rob
        manoonpong p, 2009, rob autom syst zhong zw, 2009, ind robot
        cho b-k, 2009, int j humanoid rob-a arbulu m, 2009, int j humanoid rob
        wiklendt l, 2009, neural network world
        ho t, 2009, proc spie int soc opt eng ham vr, 2009, ieee rob autom mag
        liu l, 2009, icara - proc int conf auton rob agents
        breazeal c, 2009, int j rob res zhao j, 2009, high technol letters
        bououden s, 2009, lect notes comput sci
        acosta calderon ca, 2009, rob autom syst morimoto j, 2009, auton robots
        li b, 2009, adv rob kim dw, 2009, etri j
        freidovich lb, 2009, ieee trans rob nam w, 2009, j bionic eng
        xie l, 2009, proc acm/sigevo summit genet evol comput, gec
        dean jc, 2009, j r soc interface sato t, 2009, ieej trans ind appl
        picado h, 2009, lect notes comput sci
        kim j-j, 2009, int j control autom syst goldman d, 2009, ieee spectrum
        watanabe k, 2009, adv rob siswoyo jo h, 2009, world acad sci eng technol
        harada k, 2009, j rob mechatronics kim j-y, 2009, int j humanoid rob
        yang t, 2009, auton robots jamali s, 2009, lect notes comput sci
        yu w, 2009, xitong fangzhen xuebao
        stoimenov bl, 2009, proc spie int soc opt eng xie m, 2009, ind robot
        mombaur k, 2009, robotica byl k, 2009, int j rob res
        qing t, 2009, robotica ghorbani r, 2009, int j humanoid rob
        rimassa l, 2009, ind robot wang f, 2009, ind robot
        peijie z, 2009, icara - proc int conf auton rob agents
        ratliff nd, 2009, auton robots omori h, 2009, ind robot
        argall bd, 2009, rob autom syst zielińska t, 2009, j physiol paris
        ito s, 2009, ifac proc vol (ifac-papersonline)
        ho t, 2008, ieee int conf rob, autom mechatronics, ram
        kim n-g, 2009, ieice trans fund electron commun comput sci
        taskíran e, 2009, ifac proc vol (ifac-papersonline)
        hu t, 2009, mech mach theory otoda y, 2009, adv rob
        ho t, 2009, j bionic eng asa k, 2009, rob autom syst
        hahn h, 2009, int j fuzzy syst
        turner p, 2009, ieee int conf rob biomimetics, robio
        yussof h, 2009, ifac proc vol (ifac-papersonline)
        otoda y, 2009, appl bionics biomech reichenbach t, 2009, artif life rob
        zhang b, 2008, ieee int conf rob, autom mechatronics, ram
        chen f, 2009, high technol letters
        hasanzadeh sh, 2008, ieee int conf rob, autom mechatronics, ram
        tsujita k, 2009, adv rob valdastri p, 2009, ieee trans rob
        hase t, 2009, ieee int conf rob biomimetics, robio
        huang l, 2009, j beijing inst technol engl ed
        park s, 2009, world acad sci eng technol
        sugihara t, 2009, ieee trans rob sitorus pe, 2009, j bionic eng
        shi g, 2009, icemi - proc int conf electron meas instrum
        li y, 2009, ieee int conf rob biomimetics, robio
        wang a-p, 2009, int j comput appl technol low kh, 2009, mech mach theory
        otis mj-d, 2009, ieee trans syst man cybern pt a syst humans
        zaoui c, 2009, multibody syst dyn nakatani k, 2009, adv rob
        rai jk, 2009, int j eng syst model simul
        sato t, 2009, ieej trans ind appl-a
        park jh, 2009, ieee int conf rob biomimetics, robio
        seyfarth a, 2009, int j rob res
        park jh, 2009, ieee trans syst man cybern part b cybern
        kim b, 2009, world acad sci eng technol
        vundavilli pr, 2009, appl soft comput j
        shieh m-y, 2009, int j fuzzy syst
        erbatur k, 2009, ieee trans ind electron kajita s, 2009, adv rob
        zomorodi-moghadam h, 2009, asme int mech eng congress expos proc
        wang b, 2009, j control theory appl arbulú m, 2009, appl bionics biomech
        juhász t, 2009, period polytech electr eng
        omer amm, 2009, ieee int conf rob biomimetics, robio
        kwon o, 2009, auton robots iida f, 2009, rob autom syst
        park s, 2009, int j control autom syst
        yamada m, 2009, int j adv rob syst ghorbani r, 2009, mech mach theory
        zhao w, 2009, adv rob vatau s, 2009, annals daaam proc int daaam symp
        bayraktaroglu zy, 2009, mech mach theory
        xin r, 2009, j control theory appl
        hou mt-k, 2009, world acad sci eng technol
        gini g, 2009, appl bionics biomech
        kinnaird cr, 2009, ieee trans neural syst rehabil eng
        hyon s-h, 2009, ieee trans rob hyodo k, 2009, j rob mechatronics
        karssen jgd, 2009, robotica
        omer amm, 2009, ieee int conf rob biomimetics, robio-a
        ferreira jp, 2009, ieee trans instrum meas-a
        tang j, 2009, int j adv rob syst-a bachmann rj, 2009, mech mach theory
        vallery h, 2009, ieee trans neural syst rehabil eng
        turner p, 2009, ieee int conf rob biomimetics, robio-a
        thant aa, 2009, world acad sci eng technol
        scarfogliero u, 2009, mech mach theory tlalolini d, 2009, rob autom syst
        sfakiotakis m, 2009, proc ieee int conf rob autom
        asano f, 2009, ifac proc vol (ifac-papersonline)
        maneewarn t, 2009, ieee int conf rob biomimetics, robio
        motoi n, 2009, ieee trans ind electron
        khoukhi a, 2009, int j veh auton syst
        saiki m, 2009, asia simul conf, jsst
        guan y, 2009, ieee int conf rob biomimetics, robio
        harata y, 2009, ifac proc vol (ifac-papersonline)
        chevallereau c, 2009, ieee trans rob zielinska t, 2009, mech mach theory
        kobayashi h, 2009, ieice trans inf syst pa ps, 2009, key eng mat
        esteves c, 2008, acm siggraph classes sato t, 2008, ieej trans ind appl
        matsuyama y, 2008, int conf soft comput transdisciplinary sci technol, cstst - proc
        motoi n, 2008, ieej trans ind appl
        song b, 2008, proc iasted int conf model ident control mic
        yu w, 2008, ieee int symp knowl acquis model workshop proc, kam
        virk g, 2008, ifac proc vol (ifac-papersonline)
        lin cj, 2008, proc int conf mach learn cybern, icmlc
        shrivasthava p, 2008, ieee reg colloq int conf ind inf syst, iciis
        shimada a, 2008, proc sice annu conf
        liljebäck p, 2008, model ident control
        chernova s, 2008, hri - proc acm/ieee int conf hum-rob interact: living rob
        erbatur k, 2008, proc iasted int conf intell syst control
        tushar, 2008, ieee reg colloq int conf ind inf syst, iciis
        bigdeli n, 2008, j appl sci
        sakamoto h, 2008, proc int symp artif life rob, arob
        omori h, 2008, ieee/rsj int conf intelligent rob syst, iros
        godzdanker r, 2008, proc sice annu conf
        liu lm, 2008, ieee int conf rob, autom mechatronics, ram
        phipps cc, 2008, ieee trans rob
        feng s, 2008, int conf control, autom, robot vis, icarcv
        omer amm, 2008, ieee/sice int symp syst integr: si int - symp syst integr
        bachelier m, 2008, ieee-ras int conf humanoid rob, humanoids
        chang k-h, 2008, proc ieee workshop adv rob soc impacts, arso
        ke x, 2008, ieee int symp ind electron
        freidovich l, 2008, ifac proc vol (ifac-papersonline)
        erbatur k, 2008, proc iasted int conf intell syst control-a
        farrell mt, 2008, ieee-ras int conf humanoid rob, humanoids
        silva mf, 2008, proc iasted int conf model ident control mic
        luo rc, 2008, proc ieee workshop adv rob soc impacts, arso
        satoh s, 2008, ifac proc vol (ifac-papersonline)
        yazdi ea, 2008, j comput nonlinear dyn
        meghdari a, 2008, j intell rob syst theor appl
        komiyama y, 2008, proc sice annu conf otoda y, 2008, proc sice annu conf
        zaoui c, 2008, int multi-conference syst, signals devices, ssd
        yin g, 2008, ieee asme int conf adv intellig mechatron aim
        li g, 2008, proc world congr intelligent control autom wcica
        xiang l, 2008, int conf mechatronics mach vis pract, m2vip
        wang w, 2008, ieee asme int conf adv intellig mechatron aim
        voyles rm, 2008, proc ieee int workshop saf, secur rescue rob, ssrr
        sabourin c, 2008, icinco - proc int conf informatics control, autom rob
        yussof h, 2008, proc iasted int conf control appl, ca
        xiao j, 2008, chinese contr decis conf, ccdc
        udai ad, 2008, int conf emerg trends eng technol, icetet
        rodić a, 2008, symp neural netw appl electr eng proc, neurel
        xie h, 2008, chinese contr decis conf, ccdc
        feng h, 2008, ieee asme int conf adv intellig mechatron aim
        liu gl, 2008, artif life rob maufroy c, 2008, proc sice annu conf
        norris ja, 2008, phys d nonlinear phenom
        jo s-h, 2008, int conf control, autom syst, iccas
        kunimatsu s, 2008, proc sice annu conf
        yin c, 2008, icinco - proc int conf informatics control, autom rob
        takhmar a, 2008, ieee asme int conf adv intellig mechatron aim
        yuan s, 2008, proc chin control conf, ccc
        taylor m, 2008, int conf mechatronics mach vis pract, m2vip
        kanniah j, 2008, int j humanoid rob
        kim d, 2008, int conf control, autom syst, iccas
        eich m, 2008, proc ieee int workshop saf, secur rescue rob, ssrr
        lim h-o, 2008, int conf control, autom syst, iccas
        wang m, 2008, proc ieee int conf autom logist, ical
        nakamura t, 2008, proc ieee int conf rob autom
        asano f, 2008, ieee trans rob
        chunqian f, 2008, int conf mechatronics mach vis pract, m2vip
        duan x, 2008, proc ieee int conf autom logist, ical
        botelho wt, 2008, proc sice annu conf
        shin h, 2008, ieee asme int conf adv intellig mechatron aim
        hashimoto k, 2008, j rob mechatronics
        vanderborght b, 2008, rob autom syst
        tsujita k, 2008, proc sice annu conf
        kim t, 2008, int conf control, autom syst, iccas
        fasih a, 2008, int conf mechatronics mach vis pract, m2vip
        guo q, 2008, ieee asme int conf adv intellig mechatron aim
        orner amm, 2008, icinco - proc int conf informatics control, autom rob
        chung g, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        da silva santana re, 2008, appl bionics biomech narioka k, 2008, adv rob
        kuo c-h, 2008, j harbin inst technol
        messom ch, 2008, conf rec ieee instrum meas technol conf
        fridman l, 2008, proc ieee conf decis control
        vanderborght b, 2008, int appl mech orlandi jgn, 2008, lat am appl res
        trieu m, 2008, lect notes comput sci vanderborght b, 2008, auton robots
        hobbelen dge, 2008, int j rob res
        luksch t, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        tu k, 2008, j harbin inst technol park i-w, 2008, rob autom syst
        son i-h, 2008, j harbin inst technol ye d-d, 2008, j zhejiang univ sci a
        beigzadeh b, 2008, rob autom syst chevallereau c, 2008, ieee trans rob
        wang j, 2008, ieee aisa pac conf circuits syst proc apccas
        iida f, 2008, j biomech endo g, 2008, int j rob res
        handelman da, 2008, proc spie int soc opt eng
        sabourin c, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        ha s-s, 2008, icsma - int conf smart manuf appl
        mousavi pn, 2008, appl math model
        hashimoto k, 2008, j rob mechatronics-a morimoto j, 2008, ieee trans rob
        renjewski d, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        freidovich lb, 2008, proc ieee conf decis control
        olenšek a, 2008, robotica hosoda k, 2008, rob autom syst
        maus h-m, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        hein d, 2008, lect notes comput sci vanderborght b, 2008, adv rob
        xiong r, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        lim h-o, 2008, proc r soc a math phys eng sci
        asano y, 2008, ieej trans ind appl
        pratt j, 2008, proc spie int soc opt eng
        krieg m, 2008, ieee j oceanic eng nishida m, 2008, j rob mechatronics
        kurz mj, 2008, j biomech cheung a, 2008, biol cybern
        murakami m, 2008, j comput mahboobin a, 2008, neural netw
        hwang e-s, 2008, sens mater aoi s, 2008, j rob mechatronics
        wang h, 2008, j harbin inst technol
        kim j-h, 2008, j intell rob syst theor appl ren l, 2008, j bionic eng
        sfakiotakis m, 2008, ieee int conf rob biomimetics, robio
        nenchev dn, 2008, robotica
        xie m, 2008, adv mob rob - proc int conf climbing walking rob support technol mob mach, clawar
        wong c-c, 2008, j harbin inst technol ito s, 2008, j comput
        kondo h, 2008, j rob mechatronics héliot r, 2008, rob autom syst
        park i-w, 2008, adv rob ijspeert aj, 2008, neural netw
        kumagai m, 2008, j rob mechatronics
        minakata h, 2008, ieee trans ind electron
        xu z-l, 2008, j shanghai jiaotong univ sci
        suzuki t, 2008, ieej trans ind appl
        otis mj-d, 2008, symp haptics interfaces virtual environ teleoperator syst - proc, haptics
        rodić a, 2008, robotica hu l, 2008, ieee trans ind electron
        katić dm, 2008, j intell rob syst theor appl
        yu z, 2007, proc ieee int conf mechatronics autom, icma
        xie hl, 2008, appl mech mater
        guo s, 2007, proc ieee int conf mechatronics autom, icma
        zezula p, 2007, recent adv mechatronics
        wang l, 2007, proc ieee int conf mechatronics autom, icma
        ning l, 2007, proc ieee int conf mechatronics autom, icma
        otoda y, 2008, ieej trans electr electron eng prahlad v, 2008, robotica
        kajita s, 2007, ieee rob autom mag
        hashimoto k, 2007, ieee int conf intell rob syst
        panahi m, 2007, wmsci - world multi-conf syst, cybern informatics, jointly int conf inf syst anal synth, isas - proc
        berenguer fj, 2008, ieee trans ind electron
        chernova s, 2007, proc int conf autonom agents
        fu c, 2007, proc ieee int conf mechatronics autom, icma
        ferreira jp, 2007, ieee int symp intelligent signal process, wisp
        sadati n, 2007, proc ieee int conf mechatronics, icm
        yoon j, 2007, proc iasted int conf model ident control mic
        rezaul hasan sm, 2007, proc int conf microelectron icm
        sheng t, 2007, proc ieee int conf mechatronics autom, icma
        tlalolini d, 2007,  zhu z, 2008, lect notes comput sci
        jamshidi n, 2008, am j appl sci liu l, 2008, lect notes comput sci
        xie h, 2008, int conf bioinformatics biomed eng, icbbe
        lee js, 2007, ieee int conf intell rob syst
        chen x, 2008, proc world congr intelligent control autom wcica
        li j, 2008, proc ieee int conf autom logist, ical
        ohtake s, 2008, proc sice annu conf
        valsalam vk, 2008, gecco: genet evolut comput conf - proc annu conf genet evolut comput
        zhang p, 2008, lect notes comput sci
        erbatur k, 2007, proc iasted int conf rob appl, ra proc iasted int conf telematics
        andrew am, 2008, kybernetes wong c-c, 2008, int j fuzzy syst
        silva mf, 2007, proc iasted int conf appl simul model, asm
        ferreira jp, 2007, ieee int symp intelligent signal process, wisp-a
        wang f, 2007, proc ieee int conf mechatronics autom, icma
        fu c, 2007, proc ieee int conf mechatronics autom, icma-a
        yussof h, 2008, int j adv rob syst
        otoda y, 2007, proc ieee int conf mechatronics autom, icma
        saleem ms, 2007, 
        moosavian saa, 2007, proc ieee int conf mechatronics autom, icma
        eung sk, 2007, proc iasted int conf model ident control mic
        feng s, 2008, lect notes comput sci
        trimmer ba, 2008, appl bionics biomech
        xian lb, 2008, lect notes comput sci xia z, 2008, robotica
        tanev i, 2008, gecco: genet evolut comput conf - proc annu conf genet evolut comput
        hashimoto k, 2007, proc ieee int conf rob autom
        miyagawa i, 2007, proc sice annu conf
        shimizu h, 2007, proc sice annu conf
        liu z, 2007, ieee trans syst man cybern pt c appl rev
        kang t-k, 2007, iccas - int conf control, autom syst
        yang j, 2007, inf technol j
        tabar af, 2007, ieee icit - ieee int conf integr technol
        kim t, 2007, iccas - int conf control, autom syst
        sadati n, 2007, proc ieee int workshop robot human interact commun
        luo rc, 2007, iecon proc
        kumar rp, 2007, iccas - int conf control, autom syst
        yang c, 2007, int j humanoid rob hobbelen dge, 2007, ieee trans rob
        tsujita k, 2007, proc sice annu conf
        longo d, 2007, ssrr - ieee int workshop saf, secur rescue rob proc
        jiaoyan t, 2007, conf proc ieee int conf syst man cybern
        tabar af, 2007, proc ieee int workshop robot human interact commun
        deng x, 2007, proc int conf inf acquis, icia seo y-h, 2007, adv rob
        la spina g, 2007, ieee trans rob
        xu z-l, 2007, j shanghai jiaotong univ sci
        purahong b, 2007, iccas - int conf control, autom syst
        vundavilli pr, 2007, int j humanoid rob
        chou l-p, 2007, proc int conf machine learning cybernetics, icmlc
        kim j-j, 2007, iccas - int conf control, autom syst
        ha t, 2007, rob autom syst wisse m, 2007, ieee rob autom mag
        van ham r, 2007, rob autom syst
        vo hd, 2007, proc ieee int conf mechatronics, icm
        liu gl, 2007, j adv comput intell intelligent informatics
        awa y, 2007, proc sice annu conf choi y, 2007, ieee trans rob
        shih c-l, 2007, iecon proc otoda y, 2007, proc sice annu conf
        lim h-o, 2007, iccas - int conf control, autom syst
        yong m, 2007, proc ieee int conf rob autom
        liu gl, 2007, proc sice annu conf
        hwang s-h, 2007, iccas - int conf control, autom syst
        kim y-d, 2007, ieee trans rob
        kim s-h, 2007, iccas - int conf control, autom syst
        carmona a, 2007, ieee asme int conf adv intellig mechatron aim
        shimizu m, 2007, ieee/icme int conf complex med eng, cme
        kim m, 2007, proc int conf artif intell applic
        esfahani et, 2007, ieee asme trans mechatron
        morimoto j, 2007, ieee rob autom mag
        vundavilli pr, 2007, int j humanoid rob-a
        hyon s-h, 2007, proc ieee int conf rob autom park i-w, 2007, adv rob
        huai c, 2007, proc chin control conf, ccc
        vukobratović mk, 2007, int j humanoid rob
        abdallah me, 2007, adv climbing walking rob - proc int conf, clawar
        cheng g, 2007, adv rob aoi s, 2007, auton robots
        aoi s, 2007, nonlinear dyn barai rk, 2007, inf sci
        tsujita k, 2007, ieee int conf rob biomimetics - conf proc, robio
        kim j-y, 2007, j intell rob syst theor appl
        lin c-m, 2007, ieee trans syst man cybern part b cybern
        von zitzewitz j, 2007, ieee trans neural syst rehabil eng
        woo c-k, 2007, j intell rob syst theor appl
        nakamura y, 2007, neural netw neo es, 2007, ieee trans rob
        hyon s-h, 2007, ieee trans rob
        ali s, 2007, proc ieee-ras int conf humanoid rob, humanoids
        yoo sj, 2007, int j control autom syst
        cassinis r, 2007, int j on artif intell tools
        azevedo c, 2007, biol cybern yamaguchi t, 2007, electr eng jpn
        silva mf, 2007, jvc/j vib control
        hu l, 2007, proc ieee-ras int conf humanoid rob, humanoids
        wisse m, 2007, ieee trans rob hirukawa h, 2007, ieee rob autom mag
        moosavian saa, 2007, proc ieee-ras int conf humanoid rob, humanoids
        low kh, 2007, ieee int conf rob biomimetics - conf proc, robio
        hirose m, 2007, philos trans r soc a math phys eng sci
        moosavian saa, 2007, proc ieee-ras int conf humanoid rob, humanoids-a
        lugo villeda li, 2007, proc int conf - adv dyn, instrum control, cdic
        wang z, 2007, ind robot pa ps, 2007, proc int matador conf
        tang q, 2007, adv climbing walking rob - proc int conf, clawar
        ohashi e, 2007, ieee trans ind electron
        wang b, 2007, front electr electron eng china císcar fjb, 2007, 
        lin c-m, 2007, ieee trans neural networks nikkhah m, 2007, robotica
        karakasiliotis k, 2007, ieee int conf rob biomimetics - conf proc, robio
        luksch t, 2007, adv climbing walking rob - proc int conf, clawar
        dau v-h, 2007, adv climbing walking rob - proc int conf, clawar
        sugahara y, 2007, j rob mechatronics
        hyon s-h, 2007, proc ieee-ras int conf humanoid rob, humanoids
        takuma t, 2007, j rob mechatronics lim s, 2007, j mech sci technol
        motoi n, 2007, ieee trans ind inf
        nicolau v, 2007, ifac proc vol (ifac-papersonline)
        licer o, 2007, proc ieee int conf electron circuits syst
        lee j, 2007, proc ieee-ras int conf humanoid rob, humanoids
        lim h-o, 2007, philos trans r soc a math phys eng sci
        hwang e-s, 2007, j microelectromech syst
        ghorbani r, 2007, eng appl artif intell
        matsubara t, 2007, syst comput jpn
        hirukawa h, 2007, philos trans r soc a math phys eng sci
        filipovic m, 2007, j intell rob syst theor appl
        jun g, 2007, ieee int conf rob biomimetics - conf proc, robio
        peca m, 2007, ifac proc vol (ifac-papersonline)
        harada k, 2007, ieee asme trans mechatron
        shrivastava m, 2007, j intell rob syst theor appl
        kuo ad, 2007, hum mov sci
        huang w, 2007, adv climbing walking rob - proc int conf, clawar
        park k, 2007, j mater process technol
        kryczka p, 2007, adv climbing walking rob - proc int conf, clawar
        wu y, 2007, j intell rob syst theor appl nakaoka s, 2007, int j rob res
        xi c, 2007, j donghua univ yoon jh, 2006, proc ieee int conf rob autom
        mousavi pn, 2007, appl math model
        sugahara y, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        baiquan s, 2007, ieee int conf rob biomimetics - conf proc, robio
        chalodhorn r, 2006, proc ieee int conf rob autom
        manni a, 2006, ifac proc vol (ifac-papersonline)
        wörgötter f, 2006, proc ieee-ras int conf humanoid rob, humanoids
        fu y, 2007, ieee int conf rob biomimetics - conf proc, robio
        hashimoto k, 2006, proc ieee int conf rob autom
        krasny dp, 2006, proc ieee int conf rob autom
        albero m, 2006, proc ieee-ras int conf humanoid rob, humanoids
        yin y, 2007, ieee int conf rob biomimetics - conf proc, robio
        zhu c, 2007, ieee int conf rob biomimetics - conf proc, robio
        sung s, 2007, int j adv rob syst
        hyon s-h, 2006, proc ieee-ras int conf humanoid rob, humanoids
        eaton m, 2007, lect notes comput sci
        métrailler p, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        kang t-k, 2007, lect notes comput sci
        neville n, 2006, proc ieee int conf rob autom
        maufroy c, 2007, ieee int conf rob biomimetics - conf proc, robio
        vanderborght b, 2006, proc ieee int conf rob autom
        scarfogliero u, 2006, proc ieee int conf rob autom
        park i-w, 2006, proc ieee int conf rob autom
        hashimoto k, 2006, proc ieee int conf rob autom-a
        thanhtam h, 2007, ieee int conf rob biomimetics - conf proc, robio
        ikemata y, 2006, proc ieee int conf rob autom
        hitomi k, 2006, rob autom syst
        silva mf, 2006, proc iasted int conf model ident control mic
        sadati n, 2006, proc ieee-ras int conf humanoid rob, humanoids
        liu p, 2007, int j wavelets multiresolution inf process
        hashimoto k, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        spampinato g, 2006, proc ieee-ras int conf humanoid rob, humanoids
        chacin m, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        shen w-m, 2006, proc ieee int conf rob autom
        ogura y, 2006, proc ieee int conf rob autom shibuya m, 2006, iecon proc
        denk j, 2007, eur j control
        puga jr, 2006, icinco - int conf informatics control, autom rob, proc
        aubin r, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        sugiyama y, 2006, springer tracts adv rob
        kwon o, 2006, proc iasted int conf model ident control mic
        asa k, 2006, intelligent auton syst, ias
        na, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        colon e, 2007, int j adv rob syst
        hu l, 2006, proc ieee int conf rob autom
        low kh, 2007, ieee int conf rob biomimetics - conf proc, robio-a
        huang q, 2007, ieee int conf rob biomimetics - conf proc, robio
        zhenze l, 2007, ieee int conf rob biomimetics - conf proc, robio
        arechavaleta g, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        ogura y, 2006, proc first ieee/ras-embs int conf biomed robotics biomech
        van ham r, 2006, proc ieee int conf rob autom
        sentis l, 2006, proc ieee int conf rob autom
        takai h, 2007, ieee int conf rob biomimetics - conf proc, robio
        huang q, 2006, ieee int conf rob biomimetics, robio 2006
        liu z, 2006, ieee int conf rob biomimetics, robio 2006
        lu z, 2006, ieee int conf rob biomimetics, robio 2006
        hashimoto k, 2006, ieee int conf intell rob syst
        liu z, 2006, proc world congr intelligent control autom wcica
        wongsuwarn h, 2006, ieee conf rob autom mechatronics
        che d, 2006, sice-icase int joint conf
        zhang dg, 2006, ieee conf rob autom mechatronics
        hu l, 2006, ieee int conf intell rob syst
        jahanian o, 2006, ieee int conf rob biomimetics, robio 2006
        xinhe x, 2006, ieee int conf intell rob syst
        shanqiang w, 2006, ieee int conf mechatr autom
        wu w, 2006, ieee int conf intell rob syst
        hun lc, 2006, int conf contr autom robot vis
        kabata k, 2006, sice-icase int joint conf
        lee sh, 2006, sice-icase int joint conf
        wang w, 2006, ieee int conf rob biomimetics, robio 2006
        ferreira jp, 2006, wseas trans syst
        zong g, 2006, ieee int conf mechatr autom
        li w, 2006, ieee int conf mechatr autom
        fu c, 2006, ieee int conf mechatr autom
        zhang h, 2006, ieee int conf intell rob syst
        duan x, 2006, ieee int conf intell rob syst
        huang p, 2006, ieee int conf rob biomimetics, robio 2006
        izumi k, 2006, int conf contr autom robot vis
        guo s, 2006, ieee int conf intell rob syst
        yang hs, 2006, proc ieee-ras int conf humanoid rob, humanoids
        yong m, 2006, proc world congr intelligent control autom wcica
        sugahara y, 2006, ieee int conf intell rob syst
        zhang y, 2006, proc world congr intelligent control autom wcica
        zhang w, 2006, proc ieee icia - ieee int conf inf acquis
        hirai t, 2006, sice-icase int joint conf
        kim hk, 2006, ieee int conf rob biomimetics, robio 2006
        zhang z, 2006, ieee int conf mechatr autom
        song g, 2006, proc am control conf
        sellaouti r, 2006, ieee int conf intell rob syst
        floyd s, 2006, ieee int conf intell rob syst
        hatsuda s, 2006, ieee int conf rob biomimetics, robio 2006
        yin g, 2006, ieee int conf intell rob syst
        kinugasa t, 2006, procfourth int conf biomech
        ke x, 2006, ieee int conf mechatr autom
        hase t, 2006, ieee int conf intell rob syst
        lv s, 2006, proc ieee icia - ieee int conf inf acquis
        weiguo w, 2006, ieee int conf rob biomimetics, robio 2006
        moosavian saa, 2006, ieee int conf intell rob syst
        li y, 2006, ieee int conf rob biomimetics, robio 2006
        yang w, 2006, ieee int conf intell rob syst
        aceves-lópez a, 2006, ieee lat am rob symp, lars
        jun x, 2006, int conf contr autom robot vis
        lee j, 2006, sice-icase int joint conf
        oh j-h, 2006, ieee int conf intell rob syst
        fu c, 2006, ieee conf rob autom mechatronics
        sadati n, 2006, ieee int conf rob biomimetics, robio 2006
        olenšek a, 2006, ieee int conf mechatr autom
        wang l, 2006, ieee int conf mechatr autom
        huai c, 2006, ieee int conf intell rob syst
        takahashi y, 2006, sice-icase int joint conf
        iida f, 2006, intelligent auton syst, ias
        choi k-c, 2006, sice-icase int joint conf
        guo s, 2006, ieee int conf mechatr autom
        park i-w, 2006, proc ieee-ras int conf humanoid rob, humanoids
        ogura y, 2006, ieee int conf intell rob syst
        fu c, 2006, ieee int conf intell rob syst
        tsusaka y, 2006, ieee int conf intell rob syst
        song b, 2006, sice-icase int joint conf lin p-c, 2006, ieee trans rob
        nishiwaki k, 2006, ifac proc vol (ifac-papersonline)
        sabourin c, 2006, int j rob res
        agrawal sk, 2006, ieee asme trans mechatron
        yang j-m, 2006, j intell rob syst theor appl
        kim j-y, 2006, ifac proc vol (ifac-papersonline)
        silva mf, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        huai c, 2006, wuhan ligong daxue xuebao
        matsubara t, 2006, rob autom syst vermeulen j, 2006, int j rob res
        caballero r, 2006, jvc/j vib control
        vukobratović m, 2006, sisy - serbian-hung jt symp intell syst
        hass j, 2006, int j rob res bagheri a, 2006, wseas trans syst
        aoi s, 2006, ieee trans rob santos vmf, 2006, jvc/j vib control
        verrelst b, 2006, adv rob
        mederreg l, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        bowling ap, 2006, j dyn syst meas control trans asme
        silva mf, 2006, ifac proc vol (ifac-papersonline)
        bergés p, 2006, jvc/j vib control
        santos vmf, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        terada k, 2006, rob autom syst
        yussof h, 2006, int j simul syst sci technol
        muscato g, 2006, ifac proc vol (ifac-papersonline)
        chemori a, 2006, mechatronics
        hamburger v, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        moeckel r, 2006, ind robot
        zaoui c, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        matsushita k, 2006, rob autom syst paul c, 2006, ieee trans rob
        lindblom j, 2006, connect sci
        wang l, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        mu x, 2006, ieee trans syst man cybern part b cybern
        li m, 2006, high technol letters
        katić d, 2006, sisy - serbian-hung jt symp intell syst
        vanderborght b, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        geng t, 2006, int j rob res
        lebastard v, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        lim h-o, 2006, robotica kwon o, 2006, j mech sci technol
        licer o, 2006, ifac proc vol (ifac-papersonline)
        ahmadi m, 2006, ieee trans rob shima r, 2006, electr eng jpn
        kirchner f, 2006, proc int conf offshore mech arct eng - omae
        takemura h, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        roa ma, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        choi t-y, 2006, artif life rob yeon js, 2006, j mech sci technol
        kim s, 2006, int j rob res wieber p-b, 2006, rob autom syst
        matuliauskas a, 2006, solid state phenomena
        oh jh, 2006, ifac proc vol (ifac-papersonline)
        vanderborght b, 2006, robotica
        hennion b, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        chareyron s, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        hata n, 2006, int workshop adv motion control amc
        zhang zg, 2006, jvc/j vib control yang c, 2006, robotica
        takenaka t, 2006, age ageing garcia e, 2006, ieee trans rob
        van ham r, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        puga jrt, 2006, ifac proc vol (ifac-papersonline)
        zhu c, 2006, ieej trans ind appl bruneau o, 2006, jvc/j vib control
        sugiyama y, 2006, int j rob res
        kulkarni p, 2006, j intell rob syst theor appl
        takahashi t, 2006, electr eng jpn
        aubin r, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        seipel j, 2006, int j rob res
        spampinato g, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        aoi s, 2006, int j non linear mech lebastard v, 2006, robotica
        hashimoto k, 2006, j rob mechatronics
        moeckel r, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        fauteux p, 2006, proc int conf climbing walking rob support technol mob mach, clawar
        muscato g, 2005, ieee symp emerging technol fact autom etfa
        peng z, 2005, proc ieee int conf rob autom
        zhang f, 2005, ieee/rsj int conf intell robots syst
        sugihara t, 2005, proc ieee int conf rob autom
        olenšek a, 2005, proc ieee int conf rob autom
        sugahara y, 2005, proc ieee int conf rob autom
        arbulú m, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        wisse m, 2005, int j humanoid rob
        wu w, 2005, ieee/rsj int conf intell robots syst
        crespi a, 2005, proc ieee int conf rob autom
        wisse m, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        vanderborght b, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        haavisto o, 2005, proc ieee int symp comput intell robot autom cira
        hashimoto k, 2005, proc ieee int conf rob autom
        tomokuni n, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        menon c, 2005, proc ieee int conf rob autom
        hongjun c, 2005, proc ieee int conf rob autom
        shores be, 2005, proc ieee int conf rob autom kim j-y, 2006, adv rob
        park i-w, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        yoon j, 2005, proc ieee int conf rob autom
        ogawa n, 2005, proc ieee int conf rob autom
        lei xu-s, 2005, int conf mach learn cybernet
        kameta k, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        matsushita k, 2005, proc ieee int conf rob autom
        morisawa m, 2005, proc ieee int conf rob autom
        abdallah m, 2005, proc ieee int conf rob autom
        matsubara t, 2005, proc ieee int conf rob autom
        albero m, 2005, proc ieee int symp comput intell robot autom cira
        park i-w, 2005, int j humanoid rob
        endo g, 2005, proc ieee int conf rob autom
        michel p, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        ogura y, 2005, proc ieee int conf rob autom
        gonçalves jb, 2006, j braz soc mech sci eng ma s, 2006, auton robots
        hu l, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        hicheur h, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        kwon j, 2005, proc ieee int conf rob autom
        kim h, 2005, proc ieee int conf rob autom
        matsunaga n, 2005, j rob mechatronics
        morimoto j, 2005, proc ieee int conf rob autom
        lewis ma, 2005, proc ieee int conf rob autom
        hyon s-h, 2005, proc ieee int conf rob autom
        kiguchi k, 2005, proc ieee int conf rob autom
        yumaryanto aa, 2006, key eng mat
        stilman m, 2005, proc ieee int conf rob autom
        matsubara t, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        garder lm, 2006, genetic evol comput conf
        gutmann j-s, 2005, proc ieee int conf rob autom
        anderson so, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        asano f, 2005, proc ieee int conf rob autom
        lee k-j, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        sabourin c, 2005, proc ieee int conf rob autom
        nishide s, 2005, proc ieee int conf rob autom
        kotay k, 2005, proc ieee int conf rob autom
        dauchez p, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        kajita s, 2005, proc ieee int conf rob autom
        silva f, 2005, proc ieee int symp comput intell robot autom cira
        tsakiris dp, 2005, proc ieee int conf rob autom
        menegaldo ll, 2006, j braz soc mech sci eng
        buschmann t, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        schuitema e, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        orner amm, 2005, proc 2005 5th ieee-ras int conf humanoid robots
        lambrecht bga, 2005, proc ieee int conf rob autom
        choi h-s, 2006, robotica
        vanderborght b, 2005, proc ieee int conf rob autom
        bergés p, 2005, proc ieee int conf rob autom
        harkins r, 2005, ieee asme int conf adv intellig mechatron aim
        hirukawa h, 2005, int j rob res verrelst b, 2005, mechatronics
        nishiwaki k, 2005, int conf mechatron autom
        estremera j, 2005, ieee trans rob sabourin c, 2005, rob autom syst
        verrelst b, 2005, auton robots
        wang b, 2005, ifac proc vol (ifac-papersonline)
        pongas d, 2005, ieee/rsj int conf intell robots syst
        date h, 2005, proc sice annu conf kho j-w, 2005, proc sice annu conf
        bassam d, 2005, wseas trans syst krosuri sp, 2005, int j rob res
        wisse m, 2005, int j rob res verrelst b, 2005, robotica
        goswami d, 2005, proc sice annu conf hornby gs, 2005, ieee trans rob
        nakaoka s, 2005, ieee/rsj int conf intell robots syst
        saito y, 2005, proc ieee int workshop robot human interact commun
        ferreira j, 2005, wseas trans circuits syst
        hitomi k, 2005, ieee/rsj int conf intell robots syst
        guo s, 2005, int conf mechatron autom
        horiuchi e, 2005, ieee/rsj int conf intell robots syst
        yussof h, 2005, int j adv rob syst wisse m, 2005, ieee trans rob
        li m-t, 2005, int conf mechatron autom
        morisawa m, 2005, ieee/rsj int conf intell robots syst
        choi t-y, 2005, ieee asme int conf adv intellig mechatron aim
        choi kc, 2005, proc sice annu conf
        takahashi m, 2005, ieee/rsj int conf intell robots syst
        cuevas e, 2005, proc iasted int conf control appl ca
        schiehlen w, 2005, multibody syst dyn
        muench p, 2005, proc spie int soc opt eng jha rk, 2005, rob autom syst
        manabe s, 2005, proc sice annu conf
        collins sh, 2005, proc ieee int conf rob autom
        aiko t, 2005, ieej trans ind appl minakata h, 2005, ieej trans ind appl
        takemori dkf, 2005, ifac proc vol (ifac-papersonline)
        lewis pj, 2005, proc spie int soc opt eng aoi s, 2005, auton robots
        shima r, 2005, ieej trans ind appl or j, 2005, int j humanoid rob
        neo es, 2005, ieee asme trans mechatron
        ozawa r, 2005, conf proc ieee int conf syst man cybern
        chernousko fl, 2005, solid mech appl huang q, 2005, ieee trans rob
        chaitanya vsk, 2005, nonlinear anal real world appl
        martel s, 2005, int j rob res foret j, 2005, int j humanoid rob
        watanabe k, 2005, proc sice annu conf
        takahashi y, 2005, j rob mechatronics
        spong mw, 2005, ieee trans autom control
        yang w, 2005, int conf advanced robotics icar proc
        sobotka m, 2005, ieee/rsj int conf intell robots syst
        lebastard v, 2005, ifac proc vol (ifac-papersonline)
        errahimi f, 2005, adv model anal c lewis ma, 2005, int j rob res
        pennacchio s, 2005, wseas trans circuits syst
        yamakita m, 2005, ieee asme int conf adv intellig mechatron aim
        chevallereau c, 2005, int j rob res
        takahashi y, 2005, ieee/rsj int conf intell robots syst
        sunghwan c, 2005, proc spie int soc opt eng
        chestnutt j, 2005, proc ieee int conf rob autom
        takemori f, 2005, proc sice annu conf
        duindam v, 2005, ifac proc vol (ifac-papersonline)
        feng k, 2005, int conf mechatron autom
        abba g, 2005, ifac proc vol (ifac-papersonline)
        ogura y, 2004, ieee rsj int conf intell robots and syst iros
        tsujita k, 2004, conf proc ieee int conf syst man cybern
        ferreira jp, 2004, rob trends prin applic proc biannual world autom congress
        popovic m, 2004, ieee ras int conf humanoid robots
        lim h-o, 2005, robotica
        takuma t, 2004, ieee ras int conf humanoid robots
        scarfogliero u, 2004, ieee ras int conf humanoid robots
        ono k, 2004, int j rob res
        ueda j, 2004, ieee ras int conf humanoid robots
        narukawa t, 2005, ieee/rsj int conf intell robots syst
        fukaushima t, 2004, iee conf publ
        aoi s, 2005, ieee/rsj int conf intell robots syst
        bluethmann w, 2004, ieee ras int conf humanoid robots
        nakanishi j, 2004, ieee ras int conf humanoid robots
        kim dh, 2005, lect notes comput sci
        hashimoto k, 2005, ieee/rsj int conf intell robots syst
        sugahara y, 2005, ieee/rsj int conf intell robots syst
        date h, 2005, proc int des eng tech conf comput inf eng conf
        fujiwara k, 2004, ieee rsj int conf intell robots and syst iros
        fitzpatrick pm, 2004, ieee ras int conf humanoid robots
        hang y-s, 2005, j mech sci technol
        doi m, 2004, ieee ras int conf humanoid robots
        takizawa s, 2005, ieee/rsj int conf intell robots syst
        ohashi e, 2004, proc ieee int conf ind technol
        kang y-s, 2004, ieee ras int conf humanoid robots
        takahashi y, 2004, iecon proc-a
        luo x, 2004, proc iasted int conf rob appl
        schienlen w, 2005, j mech sci technol
        koditschek de, 2004, proc spie int soc opt eng
        kurazume r, 2005, ieee/rsj int conf intell robots syst
        guo s, 2004, proc int conf robot biomim
        aoustin y, 2004, rob trends prin applic proc biannual world autom congress
        guo s, 2004, proc int conf intell mechatron autom
        surdilovic d, 2004, int conf indust inform
        takuma t, 2005, ieee/rsj int conf intell robots syst
        cupec r, 2005, ieee/rsj int conf intell robots syst
        tang z, 2004, kong zhi li lun yu ying yong
        aoi s, 2004, conf proc ieee int conf syst man cybern
        sian ne, 2004, ieee ras int conf humanoid robots
        li b, 2004, proc int conf robot biomim
        guo s, 2004, proc int offshore polar eng conf
        kwek lc, 2005, intell autom soft comp
        ikebe m, 2004, proc ieee int conf ind technol
        ye c, 2004, proc int conf robot biomim
        sugahara y, 2004, ieee rsj int conf intell robots and syst iros
        pajaziti a, 2005, proc int des eng tech conf comput inf eng conf
        mombaur kd, 2005, robotica
        park i-w, 2004, ieee ras int conf humanoid robots
        nakamura y, 2005, j rob mechatronics
        toda k, 2004, ieee ras int conf humanoid robots
        hasegawa k, 2004, ieee tech exhib based conf rob autom proc texcra
        peng z, 2004, proc int conf robot biomim
        wisse m, 2004, ieee ras int conf humanoid robots
        zhu c, 2005, ieee/rsj int conf intell robots syst
        morimoto j, 2004, ieee ras int conf humanoid robots
        zhao x, 2004, ieee rsj int conf intell robots and syst iros
        lee yp, 2004, proc ieee int conf rob autom
        miyashita t, 2004, rob autom syst
        sim w-y, 2004, ieee conf rob autom mechatron
        tiong yk, 2004, ieee conf rob autom mechatron
        sakata k, 2004, proc sice annu conf kim j-h, 2004, adv rob
        suzuki k, 2004, ieej trans ind appl
        sugiyama y, 2004, ieee rsj int conf intell robots and syst iros
        li z, 2004, proc ieee int conf rob autom
        he x, 2004, ieee conf rob autom mechatron horchler ad, 2004, adv rob
        takahashi y, 2004, proc sice annu conf nakanishi j, 2004, rob autom syst
        yuksel b, 2004, ieee conf rob autom mechatron
        azevedo c, 2004, mechatronics asano f, 2004, ieee trans rob autom
        tan g, 2004, proc world congr intelligent control autom wcica
        pfeiffer f, 2004, int j humanoid rob
        daya b, 2004, proc iasted int conf neural netw comput intell
        vukobratović m, 2004, robotica lim h-o, 2004, robotica
        altendorfer r, 2004, int j rob res hirukawa h, 2004, rob autom syst
        tabrizi ss, 2004, proc iasted int conf appl inf
        guo s, 2004, proc ieee int conf rob autom okumura y, 2004, adv rob
        azevedo c, 2004, rob autom syst tsuji t, 2004, ieej trans ind appl
        tsujita k, 2004, proc sice annu conf grand c, 2004, int j rob res
        caballero r, 2004, int j rob res tomita n, 2004, proc sice annu conf
        takuma t, 2004, proc sice annu conf
        li t-y, 2004, proc ieee int conf rob autom zhou c, 2004, adv rob
        ye c, 2004, ieee rsj int conf intell robots and syst iros
        kim j-h, 2004, proc ieee int conf rob autom
        westervelt er, 2004, int j rob res ishida t, 2004, adv rob
        mitobe k, 2004, ieee rsj int conf intell robots and syst iros
        tawara t, 2004, int j rob res zhou c, 2004, adv rob-a
        kho j, 2004, proc sice annu conf asa k, 2004, proc sice annu conf
        park jh, 2004, jsme int j ser c figliolini g, 2004, robotica
        ogura y, 2004, rob autom syst
        menciassi a, 2004, ieee rsj int conf intell robots and syst iros
        zhou c, 2004, ieee conf rob autom mechatron
        jiang wy, 2004, trans inst meas control
        chemori a, 2004, ieee trans autom control
        albero m, 2004, ifac proc vol (ifac-papersonline)
        komura t, 2004, proc acm symp virtual reality softw technol vrst
        nichol jg, 2004, chin j mech eng engl ed
        najafi f, 2004, ifac proc vol (ifac-papersonline) lim h-o, 2004, adv rob
        guardabrazo ta, 2004, ind robot chew c-m, 2004, robotica
        vukobratović m, 2004, int j humanoid rob
        kohl n, 2004, proc ieee int conf rob autom
        kim j-h, 2004, j adv comput intell intelligent informatics
        arena p, 2004, planet space sci
        tu k-y, 2004, j chin inst eng trans chin inst eng ser a
        menciassi a, 2004, proc ieee int conf rob autom
        ogura y, 2004, proc ieee int conf rob autom
        chevallereau c, 2004, robotica guihard m, 2004, int j modell simul
        nakada k, 2004, intell autom soft comp ke x, 2004, acta mech solida sin
        hurmuzlu y, 2004, automatica
        yoon j, 2004, ifac proc vol (ifac-papersonline)
        yamakita m, 2004, adv rob shiriaev a, 2004, proc ieee conf decis control
        gonçalves nf, 2004, ifac proc vol (ifac-papersonline)
        ishikawa m, 2004, ifac proc vol (ifac-papersonline)
        popovic m, 2004, proc ieee int conf rob autom
        endo g, 2004, proc ieee int conf rob autom
        mu x, 2004, asme dyn syst control div publ dsc
        tanev i, 2004, lect notes comput sci
        morisawa m, 2004, seimitsu kogaku kaishi carbone g, 2004, robotica
        yamakita m, 2004, ifac proc vol (ifac-papersonline) wu q, 2004, robotica
        sugahara y, 2004, proc ieee int conf rob autom
        song g, 2003, ieee int conf intell rob syst montes h, 2004, ind robot
        khraief n, 2003, eur control conf, ecc
        shibata m, 2003, ieej trans ind appl
        kawasumi k, 2003, proc sice annu conf
        dordević gs, 2003, int conf telecommun mod satell, cable broadcast serv, telsiks - proc
        mitobe k, 2003, proc sice annu conf
        campbell d, 2003, proc ieee int conf rob autom
        rincón dm, 2003, ieee rob autom mag
        sugimoto y, 2003, proc sice annu conf dou r-j, 2003, j dong hua univ
        ito s, 2003, ifac proc vol (ifac-papersonline) yamasaki f, 2003, adv rob
        miyashita k, 2003, mechatronics
        lim h-o, 2003, ieee asme int conf adv intellig mechatron aim
        saidouni t, 2003, robotica takahashi t, 2003, ieej trans ind appl
        park jh, 2003, ieee asme int conf adv intellig mechatron aim
        kajita s, 2003, adv rob westervelt er, 2003, ieee trans autom control
        mu x, 2003, robotica
        matsushita k, 2003, proc ieee int symp comput intell robot autom cira
        okada m, 2003, proc ieee int conf rob autom
        wollherr d, 2003, ieee asme int conf adv intellig mechatron aim
        oh s-n, 2003, int j control autom syst
        liu r-q, 2003, j harbin inst technol zhou c, 2003, fuzzy sets syst
        yamakita m, 2003, proc spie int soc opt eng
        park jh, 2003, fuzzy sets syst
        chevallereau c, 2003, ieee trans rob autom
        carbone g, 2003, ieee asme int conf adv intellig mechatron aim
        jeong y, 2003, nanotechnol conf trade show nanotech
        di giamberardino p, 2003, iasted int conf model identif control
        vaughan cl, 2003, j biomech kamamichi n, 2003, proc sice annu conf
        ishiguro a, 2003, adapt behav
        albert a, 2003, j intell rob syst theor appl
        sun l, 2003, icems - proc int conf electr mach syst
        kwek lc, 2003, j intell rob syst theor appl nagakubo a, 2003, adv rob
        ito d, 2003, ieej trans ind appl
        liu l, 2003, proc ieee int symp comput intell robot autom cira
        kawasumi k, 2003, ieej trans electron inf syst
        wang z, 2003, icems - proc int conf electr mach syst
        ogura y, 2003, ieee asme int conf adv intellig mechatron aim
        ahn ck, 2003, ieee asme int conf adv intellig mechatron aim
        ichinose we, 2003, annu int conf ieee eng med biol proc
        figliolini g, 2003, ieee asme int conf adv intellig mechatron aim
        löffler k, 2003, int j rob res plestan f, 2003, ieee trans rob autom
        bebek o, 2003, ieee conf control appl proc
        muthuraman s, 2003, proc iasted int conf artif intell soft comput
        silva mf, 2003, proc asme des eng tech conf yim m, 2003, auton robots
        ikemata y, 2003, proc sice annu conf
        takahashi y, 2003, proc sice annu conf
        zhou y-l, 2003, int conf mach learn cybern yoneda k, 2003, int j rob res
        mi z, 2002, chin j mech eng engl ed daiki i, 2002, ieej trans ind appl
        saga n, 2002, proc spie int soc opt eng
        azevedo c, 2002, ifac proc vol (ifac-papersonline) zhou c, 2002, inf sci
        medrano-cerda ga, 2002, ifac proc vol (ifac-papersonline)
        kochan a, 2002, ind robot sugar tg, 2002, ieee trans rob autom
        hwang c-l, 2002, proc ieee conf decis control
        toshiaki t, 2002, ieej trans ind appl
        takemori f, 2003, ieee asme int conf adv intellig mechatron aim
        kwon o, 2002, adv rob shibata m, 2002, ieej trans ind appl
        spong mw, 2002, ifac proc vol (ifac-papersonline)
        westervelt er, 2003, ieee trans autom control-a chew c-m, 2002, robotica
        birch mc, 2002, ieee rob autom mag
        westervelt er, 2002, ifac proc vol (ifac-papersonline)
        tummala rl, 2002, ieee rob autom mag garcia e, 2002, robotica
        liu z, 2003, ieee trans syst man cybern part b cybern
        kaneko m, 2002, ieee int conf intell rob syst
        doerschuk pi, 2002, appl intell duysens j, 2002, j biomech
        nagasu h, 2002, j rob mechatronics capi g, 2002, rob autom syst
        gonçalves jb, 2003, j braz soc mech sci eng
        zhao j, 2002, proc of the 2nd internat symp on instrument sc and technol
        chernousko fl, 2003, jvc/j vib control
        hardt m, 2002, ifac proc vol (ifac-papersonline)
        kuroki y, 2002, j rob mechatronics
        kwek lc, 2002, ieee reg 10 annu int conf proc tencon
        chevallereau c, 2002, ifac proc vol (ifac-papersonline)
        kochan a, 2003, ind robot gravez f, 2002, proc ieee int conf rob autom
        chew c-m, 2001, rob autom syst nakamura y, 2001, rob autom syst
        huang q, 2001, ieee trans rob autom capi g, 2001, eng j univ qatar
        sellaouti r, 2002, proc ieee int conf rob autom
        endo k, 2002, proc ieee int conf rob autom
        khoukhl a, 2001, mhs - proc int symp micromechatronics hum sci
        kuffner jr jj, 2002, auton robots ono k, 2001, int j rob res
        yamakita m, 2001, adv rob wu w, 2001, proc sice annu conf
        kagami s, 2002, auton robots gálvez ja, 2001, ieee asme trans mechatron
        rostami m, 2001, robotica kamegawa t, 2002, proc ieee int conf rob autom
        lim h-o, 2002, adv rob azevedo c, 2002, proc ieee int conf rob autom
        guihard m, 2001, proc ieee int conf syst man cybern
        furuta t, 2001, rob autom syst
        schwab al, 2001, proc asme des eng tech conf
        mcgee tg, 2001, ieee conf control appl proc
        chevallereau c, 2001, robotica kimura h, 2001, adv rob
        ota y, 2001, ieee int conf intell rob syst
        funabashi h, 2001, jsme int j ser c rostami m, 2001, robotica-a
        geng t, 2002, proc am control conf neuhaus p, 2001, ieee rob autom mag
        collins sh, 2001, int j rob res wisse m, 2001, robotica
        rooks b, 2002, ind robot takeuchi h, 2001, proc ieee int conf rob autom
        park jh, 2001, ieee trans rob autom
        hasegawa y, 2000, nihon kikai gakkai ronbunshu c ceccarelli m, 2000, 
        reinkensmeyer dj, 2000, j rehabil res dev
        colombo g, 2000, j rehabil res dev
        caldwell dg, 2001, ieee asme int conf adv intellig mechatron aim
        bai s, 2001, proc ieee int conf rob autom
        akdas d, 2001, proc inst mech eng part c bayraktaroglu zy, 2000, adv rob
        shibata m, 2000, 
        marchese s, 2001, ieee asme int conf adv intellig mechatron aim
        zhou c, 2000, soft comput suzuki s, 2001, proc am control conf
        uchida h, 2000, nihon kikai gakkai ronbunshu c capi g, 2001, adv rob
        witus g, 1998, proc spie int soc opt eng hirose s, 1998, adv rob
        yamaguchi ji, 1998, adv rob sardain p, 1999, control eng pract
        sardain p, 1998, ieee trans syst man cybern pt a syst humans
        ogasawara k, 1999, j rob mechatronics chao l-p, 1999, mater des
        abba g, 1999, auton robots takanishi a, 1998, adv rob
        matsumoto o, 1998, adv rob
        utsumi m, 1999, nihon kikai gakkai ronbunshu c
        ouezdou fb, 1998, multibody syst dyn
        hu j, 1998, proc - ieee int jt symp intell syst
        furuta t, 1999, j rob mechatronics
        fujimoto y, 1998, proc ieee int conf rob autom yi ky, 1997, auton robots
        rostami m, 1998, proc ieee int conf rob autom
        yamaguchi j, 1997, auton robots goswami a, 1997, auton robots
        uchida h, 1997, proc asme des eng tech conf
        tzafestas sg, 1997, j intell rob syst theor appl
        garcia m, 1998, proc ieee int conf rob autom
        jalics l, 1997, auton robots kajita s, 1997, auton robots
        boone gn, 1997, auton robots
        smith ac, 1998, proc ieee int conf rob autom
        venkataraman st, 1997, rob autom syst
        braught g, 1996, proc spie int soc opt eng
        tan g, 1997, trans nonferrous met soc china
        magdalena l, 1997, int j approximate reasoning
        medrano-cerda ga, 1997, trans inst meas control shih c-l, 1997, robotica
        mitobe k, 1997, auton robots gorce p, 1997, j intell rob syst theor appl
        cheng m-y, 1996, robotica jalics l, 1997, auton robots-a
        channon ph, 1996, proc inst mech eng part c j mech eng sci
        nishi a, 1996, comput electr eng
        pratt j, 1998, proc ieee int conf rob autom
        vukobratović m, 1996, j intell rob syst theor appl
        benbrahim h, 1997, rob autom syst vanel o, 1997, robotica
        arakawa t, 1997, j rob mechatronics
        yamaguchi j, 1998, proc ieee int conf rob autom
        fujimoto y, 1996, j rob mechatronics
        cao m, 1998, proc ieee int conf rob autom
        medrano-cerda ga, 1996, iee colloq dig
        roussel l, 1998, proc ieee int conf rob autom
        nilsson m, 1998, proc ieee int conf rob autom
        takanishi a, 1993, j rob mechatronics kajita s, 1993, j rob mechatronics
        tanaka y, 1992, nihon kikai gakkai ronbunshu c
        sano a, 1993, j rob mechatronics
        raibert mh, 1991, proc annu conf comput graphics interact tech, siggraph
        shishkin sl, 1992, int j adapt control signal process
        channon ph, 1996, proc inst mech eng part c j mech eng sci-a
        kurematsu y, 1993, j rob mechatronics naghdy f, 1992, autom constr
        seo y-j, 1995, robotica nogai t, 1995, seimitsu kogaku kaishi
        shigematsu y, 1991, nihon kikai gakkai ronbunshu c
        kanai h, 1992, nihon kikai gakkai ronbunshu c
        barry jd, 1992, autom constr kodama r, 1993, j rob mechatronics
        channon ph, 1992, robotica dubrawski a, 1994, rob autom syst
        tan g, 1995, j cent south univ technol
        sano a, 1988, nihon kikai gakkai ronbunshu c
        cotsaftis m, 1989, rob autom syst
        yamashita t, 1989, nihon kikai gakkai ronbunshu c
        katoh r, 1984, automatica tagawa y, 1989, nihon kikai gakkai ronbunshu c
        sano a, 1988, nihon kikai gakkai ronbunshu c-a
        kurematsu y, 1990, j rob mechatronics
 [ 達到了 getOption("max.print") -- 省略最後 5 列 ]]
 Columns:
        biped robot locomotion humanoid robot biped walking legged locomotion
        biped robots humanoid robots legged robots biped locomotion    biped
             zmp  robotics reinforcement learning stability bipedal robot
        passive dynamic walking  humanoid central pattern generator
        zero moment point gait planning simulation bipedal walking
        bipedal locomotion optimization quadruped robot kinematics   control
         dynamics   walking dynamic walking motion control motion planning
            robot genetic algorithm trajectory planning biped walking robot
             gait legged robot inverse kinematics limit cycle balance control
           bipeds walking robot central pattern generator (cpg) bipedal robots
        path planning gait generation model predictive control passive walking
        push recovery force control hybrid systems
        humanoid and bipedal locomotion optimal control zero moment point (zmp)
        energy efficiency mobile robots walking gait trajectory generation
        biomechanics       cpg mobile robot neural network adaptive control
        uneven terrain   running walking control walking pattern generation
        walking robots compliance poincaré map quadruped locomotion snake robot
          balance inverted pendulum nonlinear control    robots
        central pattern generators     chaos mechanism design stability analysis
        walking pattern biped humanoid robot gait transition  modeling
        robot dynamics dynamic simulation impedance control trajectory
        biomimetics exoskeleton gait analysis hybrid zero dynamics
        locomotion control mechanical design parallel mechanism robot control
        robot kinematics robust control snake-like robot
        biologically-inspired robots evolutionary robotics      foot
        genetic algorithms neural networks neural oscillator robot design
        soft robotics underactuated robots bifurcation dynamic stability
             lipm modular robot preview control climbing robot
        deep reinforcement learning dynamic modeling humanoid robotics
        limit cycle walking machine learning obstacle avoidance quadruped
        robustness climbing robots compliance control    design
        distributed control dynamic model  friction gait optimization       leg
        particle swarm optimization rough terrain sliding mode control
        zero-moment point   bipedal dynamic analysis   hexapod hexapod robot
        posture control actuators angular momentum basin of attraction
        double support phase inverted pendulum model microrobot
        undulatory locomotion whole-body control zero dynamics biomimetic robots
        center of mass force sensor gait design ground reaction force
        learning control learning from demonstration limit cycles
        passive dynamics q-learning rehabilitation variable stiffness
        bio-inspired biped gait fuzzy control gait cycle imitation learning
           impact    matlab modelling optimization and optimal control
        single support phase soft robot stable walking underactuation
        bio-inspired robot bio-inspired robotics bipedal walking robot
        compensatory motion disturbance rejection feedback control
        gait synthesis human locomotion    humans  learning
        linear inverted pendulum model pneumatic artificial muscle
        robot sensing systems stabilization trajectory optimization
        zero-moment point (zmp) capture point footstep planning gait control
        human-robot interaction modular robots motion capture
        multi-objective optimization navigation orbital stability
        rehabilitation robotics sensor fusion shape memory alloy teleoperation
        walking machines walking speed wall-climbing robot
        artificial intelligence biped robot with heterogeneous legs   dynamic
        dynamic balance efficiency energy consumption      hubo human walking
        inverse dynamics manipulation mechatronics
        model predictive control (mpc) motion generation multibody dynamics
        oscillator pid controller       pso quadratic programming
        reconfigurable robot robot learning  tracking underactuated system
        walking stability ankle joint biomimetic robot collision avoidance
        compass-gait biped robot control of robotic systems control strategy
        control system decentralized control deep learning degrees of freedom
        feedback linearization fish robot fuzzy logic gait pattern generation
          hopping human biomechanics human gait humanoid walking humanoids
          jumping kalman filter kinematic analysis linear inverted pendulum
        mathematical model passivity phase resetting poincare map  reflexes
        robot locomotion robotic fish screw theory   sensors
        spring-loaded inverted pendulum stability control trajectory tracking
        underactuated adaptive behavior   arduino autonomous robots
        balance recovery bioinspired robot biologically inspired robots
        biped mechanism biped walk control systems      cpgs dynamic control
        earthworm     force gait pattern hybrid system image processing
        imitation iterative learning control localization lyapunov exponents
        motion analysis   muscles nonlinear systems pattern generation
        quadruped walking   robocup simmechanics soft robot materials and design
        soft robots state estimation synchronization system identification
        underactuated mechanical systems underactuated systems upper body
        virtual constraints virtual holonomic constraints
        zmp (zero moment point) 3d printing adaptive walking  adhesion
        amphibious robot artificial leg biologically inspired control biomimetic
        biorobotics bipedal robotics center of pressure compass gait
        contact force cost of transport disturbance observer
        divergent component of motion dynamic gait dynamic walk    energy
        extended kalman filter foot mechanism forward kinematics      fpga
        gait stability genetic algorithm (ga) icpf actuator kinematic
        locomotion analysis       lqr mechanical systems motor control
        neural control nonlinear oscillators optimal gait optimal trajectory
        parametric excitation pneumatic actuator postural stability propulsion
        proximal policy optimization quadrupedal locomotion robot soccer
          robotic series elastic actuator  simulink      slip  slipping
        sloping surface soft robot applications support polygon       svr
          turning whole body control acceleration arm swing artificial muscle
        artificial neural network artificial neural networks
        asymptotic stability balancing balancing control bio-inspiration
        biomimetic robotics biped locomotion robot biped robot locomotion
        biped walker bipedal robotic walking central pattern generator(cpg)
        chaos control climbing stairs compliant leg       dsp
        dynamic bipedal walking evolutionary algorithms exoskeletons
        fuzzy controller gait learning gait model hierarchical control       hip
            human inertial measurement unit (imu) interlimb coordination
             ipmc jumping robot kinematic model
        linear inverted pendulum model (lipm) mechanism micro-robot
        micro biped robot  mobility     model    motion       nao
        natural dynamics nonlinear dynamics online learning optimal design
        optimal trajectory planning parametric optimization
        passive dynamic walker policy gradient position control
        predictive control pushing motion robot motion robust walking    sensor
        sensory feedback servo motor stability criterion stair climbing
        staircase    stairs stiffness stretch walking support vector machine
        support vector regression (svr) swing phase  symmetry tensegrity
        torque control     torso virtual model control    vision wearable robot
        wheeled robot yaw moment 3-d linear inverted pendulum model (lipm)
               3d 3d biped robot adams simulation bayesian optimization
        bifurcations bio-inspired design bioinspired robotics bionic robot
        biped climbing robot biped control biped locomotor biped robot walking
        biped robotics bipedal walk capturability compass biped robot
        computer simulation   contact contact modeling control algorithm
        control architecture control lyapunov function coordination       cop
        cyclic-fold bifurcation   damping deep deterministic policy gradient
        ditch crossing dynamic balance margin dynamic locomotion
        dynamics modeling dynamics of walking dynamics simulation
        embedded systems embodiment experimental validation external force
        feedforward control fixed point foot placement
        function approximation technique gait generator gorilla robot
        gravity compensation human-carrying robot human-like biped gait
        hybrid control impedance       imu inclined plane inspection
        intelligent bionic leg interaction     khr-2 kinematics analysis
        lateral undulation leg mechanisms    legged locking mechanism
        locomotion gait locomotion pattern mechanical engineering
        mechanical structure mechanics microactuator mobile robotics
        motion primitives nao robot natural walking neural controller
        nonlinear model predictive control obstacle crossing
        online trajectory generation optimisation parallel leg mechanism
        parameter optimization particle filter passive dynamic walk passive gait
        pd controller performance analysis periodic motion       pid
        piezoelectric piezoelectric actuator  planning pneumatic actuation
        postural control power consumption prosthetics prototypes
        quadruped robots quadrupeds redundancy redundant leg redundant robots
        sagittal gait sensory information slip model snake locomotion   springs
        stability margin stability region static gait static walking       toe
           torque trajectory generator under-actuated biped robot viability
        virtual prototype virtual reality walking locomotion walking trajectory
        wall climbing robot wearable robots wheeled locomotion   3d-lipm
        3d bipedal robot 3d walking 5-link biped robot active force control
         actuator adaptation admittance control algorithm ankle stiffness
        arduino uno artificial muscles ascending and descending gaits
        autonomous robot bio-inspired robots bioinspiration bioinspired
        biologically inspired robotics biomimicry biped humanoid robots
        biped system biped walking machine bipedal gait bipedal robot locomotion
        bounding locomotion      brhl caterpillar center of gravity
        center of mass (com) compass-gait biped model compass-like biped
        compliant actuation compliant ground compliant mechanisms
        computed-torque control computed torque control computer vision
        constraint contact dynamics control technology controlled poincaré map
        controller cooperative control     crawl cubic spline interpolation
        cyclic walking gait dead reckoning deformation degree of freedom
        degree of freedom (dof) delayed feedback control design engineering
        differential evolution dynamic optimization dynamical systems
        dynamically balanced gait dynamics model       eap earthworm-like robot
        efficient gait energetics energy control energy optimization
        energy shaping entertainment evolutionary algorithm exploration
        fast marching method feedback network finite state machine foot rotation
        foot trajectory four-legged robot     fuzzy fuzzy logic control
        fuzzy systems gait adaptation gait rehabilitation gait tracking
        gait trajectory    gallop genetic-fuzzy system genetic programming
        geometric mechanics ground reaction forces human motion
        hybrid locomotion hybrid zero dynamics (hzd) hydrodynamics
        impact dynamics impulsive hybrid system interface     joint      jump
            khr-3    kinect landing control leg-wheel robot     limbs
        linear actuator linear quadratic regulator      lstm lyapunov stability
        mathematical modeling mechanical energy metatarsophalangeal joint
        micro robot model learning for control
        modifiable walking pattern generator (mwpg)   modular
        morphological computation morphology motion imitation
        movement primitives multibody system multimodal locomotion
        musculoskeletal robot natural machine motion neuro-fuzzy control
        neuro-fuzzy systems      nmpc nonlinear system numerical simulation
        omnidirectional walk operational space control orbital stabilization
        oscillators parallel robots partial feedback linearization
        passive compliance passive walker passivity-based control perception
        periodic gait phase reset pid control planar biped robot
        pneumatic actuators poincaré return map poincaré sections
        policy gradient learning polychaete annelids   posture prosthesis
         push-off quadrupedal robot reactive control recurrent neural network
        recurrent neural networks rimless wheel robot operating system
        robot vision robot walking robotic foot robotic leg       ros    safety
        sagittal plane self-organized locomotion semi-passive dynamic walking
        semi-passive walking sensorimotor loop series elastic actuation
        service robots     servo simulated annealing     slope snake robots
        space robot spiking neural networks spinal cord injury    spring
        stability of hybrid systems state feedback  steering  stepping
        structure optimization tactile sensor teaching material toe joint
        torso control tracking control trajectories transverse linearization
        truncated fourier series under-actuated system underactuated robot
        various walking motions velocity control vibration virtual gravity
        virtual leg visual servoing wabian-2r walking biped walking experiment
        walking motion walking patterns walking planning walking stabilization
        whole-body dynamics wobbling mass workspace zero-moment-point
        zmp control
 [ 達到了 getOption("max.print") -- 省略最後 5 列 ]]
$km.res
Call:
hclust(d = dist(df), method = "average")
Cluster method   : average 
Distance         : euclidean 
Number of objects: 753 
$graph_terms

$graph_dendogram
$dend
'dendrogram' with 2 branches and 753 members total, at height 19.433 
$line
[1] 12.1094
attr(,"class")
[1] "bibliodendrogram"
$graph_documents_Contrib

$graph_documents_TC

$docCoord
                                                        dim1       dim2
argall bd, 2009, rob autom syst                  0.109021330 -0.1658096
vukobratović m, 2004, int j humanoid rob         0.086538252 -0.0910911
ijspeert aj, 2008, neural netw                   0.056967212 -0.1497014
colombo g, 2000, j rehabil res dev               0.080456442 -0.1036717
huang q, 2001, ieee trans rob autom              0.080920428 -0.0385939
ham vr, 2009, ieee rob autom mag                 0.076147132 -0.1405425
collins sh, 2001, int j rob res                  0.073044848 -0.0739829
kuindersma s, 2016, auton robots                -0.000636391 -0.0651157
kuo ad, 2007, hum mov sci                        0.090716437 -0.0730041
reinkensmeyer dj, 2000, j rehabil res dev        0.083875978 -0.1617059
kohl n, 2004, proc ieee int conf rob autom       0.110841743 -0.0223322
koolen t, 2012, int j rob res                    0.093629815 -0.0907614
zeng h, 2015, adv mater                          0.024088667 -0.1945907
chestnutt j, 2005, proc ieee int conf rob autom  0.096219748 -0.0831805
spröwitz a, 2013, int j rob res                  0.111609481 -0.1405947
                                                    contrib   TC Cluster
argall bd, 2009, rob autom syst                 1.03864e-05 2661       1
vukobratović m, 2004, int j humanoid rob        5.55177e-06 1855       1
ijspeert aj, 2008, neural netw                  1.12782e-05 1578       1
colombo g, 2000, j rehabil res dev              3.02814e-06 1052       1
huang q, 2001, ieee trans rob autom             2.12000e-06  822       1
ham vr, 2009, ieee rob autom mag                1.12320e-05  803       1
collins sh, 2001, int j rob res                 2.85098e-06  668       1
kuindersma s, 2016, auton robots                1.49128e-06  649       1
kuo ad, 2007, hum mov sci                       7.15267e-06  450       1
reinkensmeyer dj, 2000, j rehabil res dev       5.83506e-06  440       1
kohl n, 2004, proc ieee int conf rob autom      2.24804e-06  433       1
koolen t, 2012, int j rob res                   5.98002e-06  411       1
zeng h, 2015, adv mater                         6.76029e-06  388       1
chestnutt j, 2005, proc ieee int conf rob autom 5.68920e-06  384       1
spröwitz a, 2013, int j rob res                 2.83309e-06  378       1
 [ reached 'max' / getOption("max.print") -- omitted 4258 rows ]
$coord
$coord$coord
                                                    Dim1         Dim2
biped robot                                  6.33183e-02 -0.003732769
locomotion                                  -5.97986e-03 -0.147652378
humanoid robot                               9.50111e-02 -0.061859030
biped walking                                1.04967e-01 -0.057723159
legged locomotion                            8.32000e-02 -0.094659361
biped robots                                 9.18264e-02  0.036024870
humanoid robots                              1.01455e-01 -0.046333774
legged robots                                9.75436e-02 -0.041627078
biped locomotion                             1.00784e-01 -0.102419901
biped                                        7.06790e-02  0.004810558
zmp                                          9.01103e-02  0.010486199
robotics                                     7.63093e-02 -0.125497835
reinforcement learning                       9.76344e-02 -0.097377194
stability                                    7.83792e-02 -0.063865495
bipedal robot                               -8.40080e-03 -0.054739436
passive dynamic walking                      8.61396e-02 -0.048771598
humanoid                                     8.41556e-02 -0.034313939
central pattern generator                    8.21739e-02 -0.105693493
zero moment point                            7.88187e-02 -0.051890759
gait planning                               -2.34842e-02  0.213629728
simulation                                   4.58052e-02 -0.066298808
bipedal walking                              9.90584e-02 -0.089569621
bipedal locomotion                           9.62234e-02 -0.086930232
optimization                                -2.49174e-01 -0.045949053
quadruped robot                             -1.84735e-01 -0.126261771
kinematics                                   4.82178e-02 -0.060808783
control                                      6.83547e-02 -0.068390063
dynamics                                    -3.59310e-02 -0.071772928
walking                                     -2.49614e-02 -0.082362545
dynamic walking                              8.43099e-02 -0.048069400
motion control                               9.49822e-02 -0.005641407
motion planning                              6.79865e-02 -0.109118202
robot                                        4.78918e-02 -0.127730290
genetic algorithm                            8.57717e-02 -0.021868702
trajectory planning                          6.39883e-02 -0.028323021
biped walking robot                          1.06354e-01  0.241602073
gait                                         5.59231e-02 -0.103662728
 [ 達到了 getOption("max.print") -- 省略最後 716 列 ]]
$coord$contrib
                                 Dim1        Dim2
biped robot               3.18298e-04 1.10621e-06
locomotion                1.11294e-06 6.78533e-04
humanoid robot            2.57146e-04 1.09003e-04
biped walking             1.78243e-04 5.39020e-05
legged locomotion         1.08331e-04 1.40228e-04
biped robots              1.17874e-04 1.81421e-05
humanoid robots           1.42986e-04 2.98222e-05
legged robots             1.30500e-04 2.37664e-05
biped locomotion          1.28598e-04 1.32806e-04
biped                     5.79751e-05 2.68566e-07
zmp                       9.28066e-05 1.25680e-06
robotics                  6.55318e-05 1.77243e-04
reinforcement learning    1.03924e-04 1.03377e-04
stability                 5.77925e-05 3.83710e-05
bipedal robot             6.57710e-07 2.79250e-05
passive dynamic walking   6.71939e-05 2.15406e-05
humanoid                  6.28889e-05 1.04556e-05
central pattern generator 5.75873e-05 9.52697e-05
zero moment point         5.29807e-05 2.29635e-05
gait planning             4.02454e-06 3.33034e-04
simulation                1.45728e-05 3.05299e-05
bipedal walking           6.64294e-05 5.43124e-05
bipedal locomotion        6.10533e-05 4.98299e-05
optimization              4.03948e-04 1.37364e-05
quadruped robot           2.22033e-04 1.03720e-04
kinematics                1.47175e-05 2.34073e-05
control                   2.83447e-05 2.83741e-05
dynamics                  7.83202e-06 3.12505e-05
walking                   3.61551e-06 3.93632e-05
dynamic walking           3.93717e-05 1.27987e-05
motion control            4.99703e-05 1.76280e-07
motion planning           2.35700e-05 6.07168e-05
robot                     1.16960e-05 8.31960e-05
genetic algorithm         3.68680e-05 2.39667e-06
trajectory planning       2.05193e-05 4.02014e-06
biped walking robot       4.97237e-05 2.56601e-04
gait                      1.37480e-05 4.72391e-05
 [ reached 'max' / getOption("max.print") -- omitted 716 rows ]
$coord$cos2
                                 Dim1        Dim2
biped robot               1.87499e-03 6.51633e-06
locomotion                1.03855e-05 6.33178e-03
humanoid robot            2.39337e-03 1.01454e-03
biped walking             2.19513e-03 6.63824e-04
legged locomotion         1.57158e-03 2.03431e-03
biped robots              1.55238e-03 2.38929e-04
humanoid robots           2.01854e-03 4.21003e-04
legged robots             1.79273e-03 3.26490e-04
biped locomotion          1.86532e-03 1.92635e-03
biped                     8.60850e-04 3.98784e-06
zmp                       1.54362e-03 2.09039e-05
robotics                  1.03313e-03 2.79430e-03
reinforcement learning    1.60368e-03 1.59524e-03
stability                 1.09315e-03 7.25793e-04
bipedal robot             9.94427e-06 4.22213e-04
passive dynamic walking   1.18804e-03 3.80855e-04
humanoid                  1.16671e-03 1.93972e-04
central pattern generator 1.02230e-03 1.69125e-03
zero moment point         1.00767e-03 4.36759e-04
gait planning             8.23065e-05 6.81092e-03
simulation                3.16233e-04 6.62507e-04
bipedal walking           1.25151e-03 1.02323e-03
bipedal locomotion        1.20058e-03 9.79875e-04
optimization              9.11709e-03 3.10029e-04
quadruped robot           4.13453e-03 1.93139e-03
kinematics                3.20711e-04 5.10073e-04
control                   6.58495e-04 6.59177e-04
dynamics                  1.87206e-04 7.46972e-04
walking                   9.00888e-05 9.80824e-04
dynamic walking           9.01019e-04 2.92897e-04
motion control            1.14832e-03 4.05091e-06
motion planning           5.54679e-04 1.42887e-03
robot                     2.86636e-04 2.03891e-03
genetic algorithm         8.84806e-04 5.75183e-05
trajectory planning       4.72977e-04 9.26654e-05
biped walking robot       1.10105e-03 5.68198e-03
gait                      3.75497e-04 1.29023e-03
 [ reached 'max' / getOption("max.print") -- omitted 716 rows ]
$hull_data
# A tibble: 13 × 7
# Groups:   clust [3]
      Dim1    Dim2 clust shape label                               color      id
     <dbl>   <dbl> <int> <chr> <chr>                               <chr>   <int>
 1   0.185 -2.15       1 1     bipedal gait                        #E41A1C     1
 2  -3.06  -0.0433     1 1     dsp                                 #E41A1C     2
 3   0.174  9.45       1 1     iterative learning control          #E41A1C     3
 4   0.185 -2.15       1 1     bipedal gait                        #E41A1C     4
 5 -11.9    0.0795     2 1     microrobot                          #377EB8     1
 6 -18.1    0.195      2 1     icpf actuator                       #377EB8     2
 7 -15.5    0.177      2 1     optimisation                        #377EB8     3
 8 -11.9    0.0795     2 1     microrobot                          #377EB8     4
 9   0.243 19.2        3 1     intelligent bionic leg              #4DAF4A     1
10   0.242 18.5        3 1     gait tracking                       #4DAF4A     2
11   0.235 19.3        3 1     biped robot with heterogeneous legs #4DAF4A     3
12   0.241 20.3        3 1     artificial leg                      #4DAF4A     4
13   0.243 19.2        3 1     intelligent bionic leg              #4DAF4A     5
$params
      params values
1      field     DE
2     ngrams      2
3     method     CA
4  minDegree      4
5      clust      3
6      k.max      5
7   stemming  FALSE
8  labelsize      4
9  documents    100
10     graph  FALSE
# 轉換 Conceptual Structure Map (CS[[4]]) 為 grob1
#grob1 <- grid.grabExpr(print(CS[[4]]))
# 轉換 Topic Dendrogram (CS[[5]]) 為 grob2
#grob2 <- grid.grabExpr(print(CS[[5]]))
# 使用 ggarrange 排列圖表
#ggarrange(grob1, grob2, ncol = 2, nrow = 1)