일 | 월 | 화 | 수 | 목 | 금 | 토 |
---|---|---|---|---|---|---|
1 | 2 | 3 | ||||
4 | 5 | 6 | 7 | 8 | 9 | 10 |
11 | 12 | 13 | 14 | 15 | 16 | 17 |
18 | 19 | 20 | 21 | 22 | 23 | 24 |
25 | 26 | 27 | 28 | 29 | 30 | 31 |
- 자율탐사
- 강화학습
- RTK
- GPS
- Visual SLAM
- ROS2
- 티스토리챌린지
- 자율주행
- Puck LITE
- DevOps
- 오블완
- ZED2
- turtlebot3
- QT
- U-blox
- ROS
- ubuntu
- 인공지능
- WSL2
- Gazebo
- GUI
- SLAM
- 터틀심
- C++
- Jetson
- 로봇
- WSL
- Simulation
- 젯슨
- turtlesim
- Today
- Total
목록ZED2 (5)
직관적인느낌

sudo apt install git #에러 내용 E: Package 'git' has no installation candidate 발생시, rm -vf /var/lib/apt/lists/* sudo apt-get update
Object detection activation?? (경로: zed_wrapper/params) zed2.yaml od_enabled → true cm Running Code roslaunch zed_wrapper zed2.launch roslaunch zed_display_rviz display_zed.launch If you want running, Object detection rosrun zed_obj_det_sub_tutorial zed_obj_det_sub objes:=/zed2/zed_node/obj_det/objects Adding Object Detection in ROS | Stereolabs

Setup package zed-ros-wrapper catkin package nav_msgs tf2_geometry_msgs message_runtime catkin roscpp stereo_msgs rosconsole robot_state_publisher urdf sensor_msgs image_transport roslint diagnostic_updater dynamic_reconfigure tf2_ros message_generation nodelet Setup cd ~/catkin_ws/src git clone --recursive cd ../ rosdep install --from-paths src --ignore-src -r -y catkin_make -DCMAKE_BUILD_TYPE=..
Basic - 기본 프로그램 program path : usr/local/zed/tools samples path : usr/local/zed/samples Reference [Vision] ZED SDK, ZED Python API 설치 및 기본 사용법 Tutorial - Hello ZED | Stereolabs
Setup Check! your Jectpack version sudo apt-cache show nvidia-jetpack #Jetson Jetpack Version File downlaod - SDK ZED SDK 3.7 - Download In my case: ZED SDK for L4T 32.6 (Jetpack 4.6)3.7.2 (Jetson Nano, TX2/TX2 NX, Xavier AGX/NX, CUDA 10.2) Open terminal cd → 파일 있는곳으로 (ex: cd download) chmod +x ZED_SDK_Tegra_L4T32.6_v3.7.4.run ./ZED_SDK_Tegra_L4T32.6_v3.7.4.run How to Install ZED SDK on Nvidia J..