Skip to content
Snippets Groups Projects
Select Git revision
  • 1e138dee568cebf2e960ee3fb83a00e847f73416
  • main default
  • feature/cleanup-for-registry protected
  • kinetic
  • 0.3.7
  • 0.3.6
  • 0.3.5
  • 0.3.4
  • 0.3.3
  • 0.3.2
  • 0.2.2
  • 0.3.1
  • 0.3.0
  • 0.2.1
  • 0.1.6
  • 0.1.5
  • 0.2.0
  • 0.1.4
  • 0.1.3
  • 0.1.2
  • 0.1.1
  • 0.0.1
  • 0.0.0
23 results

gradlew.bat

Blame
  • Useful commands

    This document is a cheat sheet for useful commands

    Image detection

    • figure out the correct camera and its settings
      • get the correct device v4l2-ctl --list-devices
      • show device information (change device depending on output of above command) v4l2-ctl -d /dev/video2 --all
    • show (rectified) 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
    • interpret the apriltag message: 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

    TF and RVIZ

    • open a new RVIZ to show transformations rosrun rviz rviz
      • set Fixed Frame to CETI_TABLE_ONE
      • select Add -> TF to show TF objects

    Robot Controllers

    • send a scene manually rostopic pub -1 /connector_node_ros_ccf/send_scene std_msgs/Empty