Skip to content
Snippets Groups Projects
Select Git revision
  • bc5e4e0adbb382e01dab53138bb7a542f67bc1ec
  • noetic/main default protected
  • noetic/demo/ga-2023-1-motion-grammars
  • demo/ga-2023-1
  • noetic/feature/robotics-festival
  • feature/table-detector
  • ga-demo
  • noetic/feature/tags
  • noetic/feature/collab
  • ccnc-demo
10 results

commands.txt

Blame
  • commands.txt 955 B
    
    # 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
    
    # send a scene manually
    rostopic pub -1 /connector_node_ros_ccf/send_scene std_msgs/Empty