DEPRECATED: THIS REPOSITORY IS NO LONGER MAINTAINED
Please check out Y-modify/deepl2
An experiment to make YamaX walk in the simulation environment using ROS and Gazebo.
DeepL2 Project: https://blog.y-modify.org/2018/01/04/deepl2-start/
docker-compose up -d
then connect to localhost:5900 using VNC
. /opt/ros/lunar/setup.sh
. devel/setup.sh
roslaunch yamax_gazebo world.launch # gui:=true headless:=false if you need gui
Now you can control joints by publishing to /yamax/{joint_name}_position_controller/command
rostopic pub /yamax/neck_position_controller/command std_msgs/Float64 1.57
Will turn the head to 90°
roslaunch yamax_control yamax_control.launch
You need urdf_tutorial
package if you don't have rviz config file(.rviz)
roslaunch yamax_description display.launch