일 | 월 | 화 | 수 | 목 | 금 | 토 |
---|---|---|---|---|---|---|
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 |
- GPS
- 자율탐사
- ROS2
- 강화학습
- 오블완
- 자율주행
- Jetson
- 로봇
- Visual SLAM
- DevOps
- ROS
- WSL2
- Puck LITE
- 티스토리챌린지
- ZED2
- 젯슨
- Gazebo
- ubuntu
- 인공지능
- SLAM
- GUI
- RTK
- turtlebot3
- U-blox
- Simulation
- C++
- turtlesim
- 터틀심
- QT
- WSL
- Today
- Total
목록공학 (95)
직관적인느낌

- 전체 소스 코드 ROS - Gazebo tutorial (Official Tutorial), 튜토리얼 - Source Code(전체 코드) Source Code false 0 0 .1 0 0 0 .4 .2 .1 .4 .2 .1 -0.15 0 -0.05 0 0 0 .05 0 0 1.0 1.0 -0.15 0 -0.05 0 0 0 .05 0.1 0.13 0.1 0 1.5707 1.5707 .1 .05 .1 .05 0.1 -0.13 0.1 0 1.5707 1.5707 .1 .05 .1 .05 0 0 -0.03 0 0 0 left_wheel chassis 0 1 0 0 0 0.03 0 0 0 righ lbj142632.tistory.com - 모델 폴더생성 - 모델 Config 파일 생성 - 다음의 내용을 m..
Source Code false 0 0 .1 0 0 0 .4 .2 .1 .4 .2 .1 -0.15 0 -0.05 0 0 0 .05 0 0 1.0 1.0 -0.15 0 -0.05 0 0 0 .05 0.1 0.13 0.1 0 1.5707 1.5707 .1 .05 .1 .05 0.1 -0.13 0.1 0 1.5707 1.5707 .1 .05 .1 .05 0 0 -0.03 0 0 0 left_wheel chassis 0 1 0 0 0 0.03 0 0 0 right_wheel chassis 0 1 0
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..
터미널 창 분리하기 sudo apt-get install terminator 수직 분할 - Ctrl + Shift + E 수평 분할 - Ctrl + Shift + O 만약 에러가 발생한다면? # 에러코드 `-bash: nano: command not found` sudo apt-get install nano
Setup sourceYDLidar-SDK/how_to_build_and_install.md at master · YDLIDAR/YDLidar-SDK https://github.com/YDLIDAR/ydlidar_ros_driver cd catkin_ws/src git clone catkin_make source ./devel/setup.sh echo "source ~/ycatkin_ws/devel/setup.bash" >> ~/.bashrc # if alreay exist then pass source ~/.bashrc echo $ROS_PACKAGE_PATH # Verify that your package path is set, echo the ROS_PACKAGE_PATH variable #[Opt..

Command Line cd catkin_ws/src git clone cm Home · robopeak/rplidar_ros Wiki https://github.com/slamtec/rplidar_ros sudo chmod 666 /dev/ttyUSB0 # 포트 검색후, S1 라이다 맞는 포트 숫자를 적어준다. roslaunch rplidar_ros view_rplidar_s1.launch rosrun rplidar_ros rplidarNodeClient Reference SLAMTEC Product Documents Download and Technical Support Shanghai Slamtec Co., Ltd. Error Debug [rplidarNode-2] process has died [..
kazam sudo apt-get update # S/W** 저장소 갱신 sudo apt-get install kazam kazam ‘녹화 - screencast, 스크린샷 - screenshot’ 단축키: 녹화 시작 - ctrl + 윈도우 + r 녹화 종료 - ctrl + 윈도우 + f simplescreenrecorder setup 이 simplescreenrecorder 패키지는 since 18.04 LTS 만 사용할 수 있습니다. 빠른 검색은 https://launchpad.net/ubuntu/+ppas 을 통해 다음과 같은 PPA와 필요한 패키지를 제공한다 [ppa:maarten-baert/simplescreenrecorder]() .다음과 같은 방법으로 설치할 수 있습니다. sudo add-a..