Robot, Autonomous Vehicle
-
[GPS]NMEA Parsing and Saving with CRobot, Autonomous Vehicle 2022. 11. 7. 11:54
u-blox GPS 장치를 serial로 연결하여 NMEA message parsing 및 csv 파일 형식으로 저장하기 https://kkastory.tistory.com/37 [GPS]NMEA Output Message GPS 수신기가 처리한 데이터는 NMEA 포맷의 메시지로 사용자에 게 알려준다. NMEA 메시지에는 가장 많이 쓰는 GGA, GLL 말고도 다양한 형식이 있다. 참고 https://www.sparkfun.com/datasheets/GPS/NMEA%20Reference%20Ma kkastory.tistory.com +) ublox hex-command로 configuration 하기 https://portal.u-blox.com/s/question/0D52p00008HKCh8CAH/ub..
-
[GPS]NMEA Output MessageRobot, Autonomous Vehicle 2022. 11. 7. 11:45
GPS 수신기가 처리한 데이터는 NMEA 포맷의 메시지로 사용자에 게 알려준다. NMEA 메시지에는 가장 많이 쓰는 GGA, GLL 말고도 다양한 형식이 있다. 참고 https://www.sparkfun.com/datasheets/GPS/NMEA%20Reference%20Manual1.pdf GGA - Global Positioning System Fixed Data $GPGGA,161229.487,3723.2475,N,12158.3416,W,1,07,1.0,9.0,M, , , ,0000*18 GLL - Geographic Position ( Latitude / Longitude ) $GPGLL,3723.2475,N,12158.3416,W,161229.487,A,A*41 GSA - GNSS DOP and..
-
[Jetson Nano] Jetson Nano 에서 Object Detection ( DetectNet, SSD-MobileNetv2, Pytorch )Robot, Autonomous Vehicle 2021. 3. 24. 12:51
Hello AI World - python 10줄로 Jetson nano에서 Object detection 하기 Can be run completely onboard your Jetson(Nano/TX1/TX2/Xavier NX/AGX Xavier) , including inferencing with TensorRT and transfer learning with PyTorch. The inference portion of Hello AI World - which includes coding your own image classification and object detection applications for Python or C++, and live camera demos. System Setup S..
-
[Python OpenCV ROS] cv.cap으로 딴 이미지 compressedImage msg로 publish하기Robot, Autonomous Vehicle 2021. 3. 2. 15:47
-> Thread에서 opencv cap 함수로 webcam 혹은 usbcam 이미지 프레임별로 캡쳐해서 -> ROS topic 중에서 compressedimage msg로 publish하기 -> Thread Keyboard Interrupt 넣어서 안전하게 끄기 #!/usr/bin/env python import rospy import roslib import sys, time import cv2 import threading from sensor_msgs.msg import CompressedImage def TVStart(data) : img_thread = DroneTV() try: img_thread.daemon=True img_thread.start() except KeyboardInterru..
-
[ROS USB_CAM] 한 머신에서 multi usb_cam node 켜기Robot, Autonomous Vehicle 2021. 3. 2. 15:41
github.com/ros-drivers/usb_cam ros-drivers/usb_cam A ROS Driver for V4L USB Cameras. Contribute to ros-drivers/usb_cam development by creating an account on GitHub. github.com launch 파일 사용해야하므로 사용중인 workspace에 clone 하기 1. 현재 머신에서 사용할 수 있는 usb camera 장치 확인하기 ls -l /dev/video* -> usb혹은 내장 웹캠 장치들의 번호가 뜬다 2. camera 장치들 정보 확인하기 v4l2-ctl -d /dev/video(번호) --list-formats-ext [ex] jsnano01@jsnano01-desk..
-
[Darknet ROS] darknet_ros yolov3 코드 이것 저것 수정Robot, Autonomous Vehicle 2021. 3. 2. 15:30
github.com/leggedrobotics/darknet_ros leggedrobotics/darknet_ros YOLO ROS: Real-Time Object Detection for ROS. Contribute to leggedrobotics/darknet_ros development by creating an account on GitHub. github.com 1. 여러 머신 또는 한 머신에서 multi object detection 수행하기 -> .launch 파일 수정해야함 -> namespace 추가하기 $
-
[bash file] 이것저것Robot, Autonomous Vehicle 2021. 2. 13. 01:33
stackoverflow.com/questions/5947742/how-to-change-the-output-color-of-echo-in-linux How to change the output color of echo in Linux I am trying to print a text in the terminal using echo command. I want to print the text in a red color. How can I do that? stackoverflow.com linux terminal에서 style 넣기
-
[Jeton Nano] 환경 설정Robot, Autonomous Vehicle 2021. 2. 11. 02:10
Jetson Nano 환경설정 하려면 이거보면서 차근차근 따라하면 뚝딱입니닷 developer.nvidia.com/embedded/learn/get-started-jetson-nano-devkit#write Getting Started With Jetson Nano Developer Kit The NVIDIA® Jetson Nano™ Developer Kit is a small AI computer for makers, learners, and developers. After following along with this brief guide, you’ll be ready to start building practical AI applications, cool AI robots, and more. dev..