Cheatography
https://cheatography.com
ROS Indigo Cheat Sheet for BSCV
This is a draft cheat sheet. It is a work in progress and is not finished yet.
Workspacejmake workspace | mkdir -p ~/ros/indigo/catkin_ws | | cd ~/ros/indigo/catkin_ws/ | | catkin_make | add to source | echo "$PWD/devel/setup.bash" >> ~/.bashrc |
EnvironmentDisplay | printenv | grep ROS | Turtlebot | ROS_MASTER_URI=http://localhost:11311 | | ROS_HOSTNAME=<TURTLEBOT_IP> | Workstation | ROS_MASTER_URI=http://<TURTLEBOT_IP>:11311 | | ROS_HOSTNAME=<PC_IP> |
Packageslist | rospack list | list dependencies | rospack depends <pgk> | cd pkg dir | roscd <pkg> | rosmsg | [ list | show ] |
Rosbags and topicrosbag | [ info | play -l ] | | record [-a | <pkg> <pkg>] -O filename [--clock] | rosnode | [ list | info | ping | kill ] | rostopic | [ list | info | echo | pub ] | for gui | rqt_bag <pkg> | rqt_graph | rosparam set <param> true | enable_statistics | use_sim_time |
| | Turtlebot2Turtlebot | roslaunch turtlebot_bringup minimal.launch | make it move | rostopic pub -r 10 /mobile_base/commands/velocity geometry_msgs/Twist '{linear: {x: 0.0, y: 0.0, z: 0.0}, angular: {x: 0.0, y: 0.0, z: -0.7}}' | env | TURTLEBOT_3D_SENSOR=kinect | tutorials | |
visualisation rvis 5.1.3 kinect
Teleoperation 5.2.[1-2-4] keyboard joystick rviz_interactive
mapping 5.3
| | | | |