diff --git a/launch/commands.txt b/launch/commands.txt
new file mode 100644
index 0000000000000000000000000000000000000000..fd5c4a894f8f03d443a7e0fade069239434f894c
--- /dev/null
+++ b/launch/commands.txt
@@ -0,0 +1,37 @@
+
+# show image of camera
+rosrun image_view image_view image:=/usb_cam/image_rect
+
+# show detected image
+rosrun image_view image_view image:=/tag_detections_image
+
+rosmsg show apriltag_ros/AprilTagDetectionArray
+std_msgs/Header header
+  uint32 seq
+  time stamp
+  string frame_id
+apriltag_ros/AprilTagDetection[] detections
+  int32[] id
+  float64[] size
+  geometry_msgs/PoseWithCovarianceStamped pose
+    std_msgs/Header header
+      uint32 seq
+      time stamp
+      string frame_id
+    geometry_msgs/PoseWithCovariance pose
+      geometry_msgs/Pose pose
+        geometry_msgs/Point position
+          float64 x
+          float64 y
+          float64 z
+        geometry_msgs/Quaternion orientation
+          float64 x
+          float64 y
+          float64 z
+          float64 w
+      float64[36] covariance
+
+
+rosrun rviz rviz
+- Fixed Frame CETI_TABLE_ONE
+- Add -> TF