-
Raspberry Pi
ROS2 Rplidar & Webcam in raspberry pi4B
1. tf2_ros 적용 ros2 run rplidar_ros rplidarNode ros2 run tf2_ros static_transform_publisher 0 0 0 0 0 0 world laser_frame https://github.com/CreedyNZ/rplidar_ros2 GitHub - CreedyNZ/rplidar_ros2: rplidar_ros2 rplidar ros2 rplidar_ros2 rplidar ros2. Contribute to CreedyNZ/rplidar_ros2 development by creating an account on GitHub. github.com 2. opencv_cam install https://github.com/clydemcqueen/open..
-
ROS
URDF 생성
ref_link 41일차 - 매니퓰레이션 소개 및 URDF 작성법 목표 매니퓰레이터 모델링 (URDF 작성법) MoveIt! 사용법 매니퓰레이터 소개 수평다관절형, 수직다관절형이 특히 많이 사용되며, 직교좌표형 형태는 3D 프린터 등에서 사용되는 형태입니다. 이번 시 roomedia.tistory.com
-
Jetson Nano
Jetson nano CSI-camera
https://feicheung2016.medium.com/getting-started-with-jetson-nano-and-autonomous-donkey-car-d4f25bbd1c83 Getting started with Jetson Nano and Autonomous Donkey car Jetson Nano is a powerful and efficient single board computer made for (buzzword alert) AI on the edge. It is just USD 99 and it provides… feicheung2016.medium.com
-
Arduino
I2C LCD with ESP32
esp32 와 20x4 LCD , 4x4 keypad를 조합하여 입력장치를 꾸며봤다. 펌웨어는 여러 사이트를 참조해서 정리를 해봤다. https://randomnerdtutorials.com/esp32-esp8266-i2c-lcd-arduino-ide/ I2C LCD with ESP32 on Arduino IDE - ESP8266 compatible | Random Nerd Tutorials Learn how to use the I2C LCD (Liquid Crystal Display) with the ESP32 or ESP8266 using Arduino IDE. We'll show you how to wire the display and write code. randomnerdtutorials.com..
-
Arduino
[Encoder] Rotary Encoder with Arduino Nano/ ESP32 Dev Module
1. 사전 검토 자료 https://electropeak.com/learn/how-to-interface-a-rotary-encoder-with-arduino/ How to Interface A Rotary Encoder with Arduino - Electropeak Learn How to interface a Rotary Encoder with Arduino. using Rotary Encoder with Arduino with example code, circuit, pinout library electropeak.com https://create.arduino.cc/projecthub/hwhardsoft/how-to-use-incremental-encoders-f82068 How to Use In..
-
Python
[Modbus Program] Modbus-RTU
PLC로 구성된 Robot을 수리하기 위한 통신 방식인 Modbus-RTU를 study 해본다. 일단 기본 개념부터 확실히 정리하자. https://badayak.com/4809 MODBUS-RTU 프로토콜 쉽게 이해하기 MODBUS 프로토콜 이 글은 시리얼 통신을 잘 알고 있지만, MODBUS-RTU를 처음 접하는 분을 위해 저의 경험을 바탕으로 작성했습니다. 시리얼 통신을 꽤 오랫동안 다루었지만, MODBUS-RTU를 처음 접했을 때 badayak.com 1) Modbus Memory Map coil vs register coil -> 1bit, switch register -> 16bit(2byte), value 2) modbus 프로토콜 기본구성 3) modbus 프로토콜 메모리맵과 함수 정리 4..
-
Raspberry Pi
[Raspberry pi 4B] GPIO test
1. GPIO pinout 확인 $ pinout LED 를 GPIO 4,17,27에 Red, Yello, Green을 연결한다. ref) https://make.e4ds.com/make/learn_guide_view.asp?idx=70 e4ds MAKE make.e4ds.com
-
ROS
[ROS Programming] Making Basic Nodes with Python
참고 동영상) https://youtu.be/izfXL3rIt10 $ mkdir -p catkin_ws/src $ cd src $ catkin_create_pkg node_basic std_msgs geometry_msgs rospy $ cd node_basic $ mkdir scripts $ catkin_make $ roscore $ rosrun node_basic pulblisher.py $ rosrun node_basic subscriber.py 참고) https://hagler.tistory.com/155 (8) motor_control 노드 작성 motor_control 노드 #!/usr/bin/env python # lice..
-
DL_Algorithm
[DL Framework]Tensorflow, Pytorch GPU 사용을 위한 Nvidia Driver, CUDA, CuDNN 설치
** GPU를 이용해서 Tensorflow, Pytorch를 실행하기 위해 설치 작업을 진행해봤다. 1) Driver 설치 https://whiteglass.tistory.com/13 우분투 서버에 Nvidia 드라이버 설치 설치방법 먼저 그래픽 카드가 잘 꽂혀 있는지 확인한다. lshw -C display 서버에 설치할 수 있는 드라이버 확인한다. ubuntu-drivers devices 우분투는 nvidia-driver-460-server 를 추천하는 모양이다. nvidia-.. whiteglass.tistory.com https://codechacha.com/ko/install-nvidia-driver-ubuntu/ 우분투 18.04 - NVIDIA 드라이버를 설치하는 방법 Ubuntu 18.04에..
-
Self Driving Car
[Simulation] CARLA Simulator
Carla 설치하고 자율주행 관련된 프로그램들을 검토해볼 계획이다. 우선 설치와 관련된 글과 동영상을 참고로 설치를 진행했다. carla.readthedocs.io/en/latest/start_quickstart/#a-debian-carla-installation Quick start package installation - CARLA Simulator This guide shows how to download and install the packaged version of CARLA. The package includes the CARLA server and the Python API client library ready to run out of the box and does not require an..