lbj142632의 등록된 링크

 lbj142632로 등록된 티스토리 포스트 수는 35건입니다.

ZED2 Camera - ROS with Jetson Xavier for Object detection [내부링크]

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

ZED2 Camera - ROS with Jetson Xavier [내부링크]

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=..

ZED Camera - 튜토리얼 with Jetson Xavier(nano) [내부링크]

Basic - 기본 프로그램 program path : usr/local/zed/tools samples path : usr/local/zed/samples Reference [Vision] ZED SDK, ZED Python API 설치 및 기본 사용법 Tutorial - Hello ZED | Stereolabs

ZED Camera - Setup with Jetson Xavier(nano) [내부링크]

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

Lidar - YDLidar G2 [내부링크]

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..

Lidar - RPLidar s1 [내부링크]

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..

Linux/Ubuntu(jetson)에서 원격 접속하기 [내부링크]

ntel 계열의 Core 경우에는 AnyDesk를 이용하는게 편하겠지만 ARM코어에서는 아직 지원이 안되는것 같다. 따라서, 딜레이는 존재하지만 가능한 방법을 사용하자. 설명 링크Jetson-nano VNC 설정 [Jetson nano] 3. VNC 설정 다운로드 링크 Download VNC Viewer | VNC Connect Jetson에서 설정 터미널 창 열기 sudo vi /usr/share/glib-2.0/schemas/org.gnome.Vino.gschema.xml vi 화면이므로, 일반 텍스트 입력창과 다르다 가장 밑으로 내려서 뒤에 i를 눌러 엔터를 입력, 그리고 다음을 복사 Enable remote access to the desktop If true, allows remote ..

jetson,raspberry pi에 VScode 설치하기 [내부링크]

VSCode : 18.04 at Jetson Jetson Nano(젯슨나노) vscode- Microsoft Visual Studio Code 설치하기 Jetson Nano(젯슨나노) vscode- Microsoft Visual Studio Code 설치하기 최근 핫한 코드편집기인 마이크로소프트사의 Visual Studio Code(이하 vscode)를 ARM기반의 싱글보드 PC인 젯슨나노에 설치하기위해 알아보았습니다. IDE 장인으로 유명한 마소의 vscode는 다양한 개발환 opencourse.tistory.com !! jetson의 CPU는 intel 기반이 아니라 ARM 계열이다. 따라서 일반적인 설치 방법과 차이가 존재한다.

Bluetooth setup (FB155) [내부링크]

만일 열리지 않으면 통신속도 다른것으로 시도해서 찾기 SLAVE 설정 Master 설정 insert Programe 다운 ::: 펌테크 홈페이지에 오신 것을 환영합니다 ::: ::: 펌테크 홈페이지에 오신 것을 환영합니다 ::: www.firmtech.co.kr

강화학습 참고 자료 [내부링크]

모두를 위한 머신러닝/딥러닝 모두를 위한 머신러닝/딥러닝 강의 conda install git // github 설치 전 필수 TensorFlow를 사용한 딥러닝 모바일 프로젝트: https://github.com/jeffxtang/mobiletfbook 케라스 2.x 프로젝트 https://github.com/keras-rl/keras-rl 임베디드와 강화학습 모두의 연구소 https://github.com/modulabs/RL4RWS 강화학습 기초부터 DQN까지 강화학습 기초부터 DQN까지 (Reinforcement Learning from Basics to DQN) Policy Gradients [RL] Policy Gradient Algorithms David silver reinforcement..

4족 보행 로봇, Quadrupedalism Robot -3 [스펙 선정, 준비사항 및 기초 이론] [내부링크]

- payload 5kg - 다리 모양 구조 파악 출처: 보행로봇 공학의 이해_저자:박성호 - 수학적 기초 - 보행 로봇 시스템 - 보행 로봇의 운동학 - 보행 로봇의 모델링 +) 보행 로봇의 장애물 횡단 +) 동역학적 장애물 횡단

4족 보행 로봇, Quadrupedalism Robot -2 [기초자료- 서적, 논문 및 인터넷 자료] [내부링크]

- 견의 보행(Locomotion - naver) -DGIST 캠퍼스 생활 안전을 위한 4족 보행로봇 개발 - 강화학습을 이용한 보행 로봇 제어(황보제민_KAIST 기계공학과) - openDog V2(James Bruton -youtube) - 4족 애완로봇을 위한 보행운동 계획 - 4족 보행로봇 기구부 설계 및 제어에 관한 연구

4족 보행 로봇, Quadrupedalism Robot - 1[기초자료, 강아지] [내부링크]

출처:http://www.bellahusk.com/en/home.html : 두 다리가 조금 넓은 A자 형태로 좌우 벌어져 있다. 그 결과 '엉금엉금' 기어가듯이 걷는다. 끄는 힘을 극대화한 하역견을 탄생시키기 위해, 뒷다리가 약간 벌어져 있는 골격이 무거운 중량의 짐이나 썰매를 끌 때 훨씬 유리하다는 사실. 지나치게 긴 다리도 오랜 시간 썰매를 끌어야하는 사역견의 임무에 알맞지 않았기 때문에 더욱 큰 힘과 지구력을 감당할 수 있는, 오늘날 우리의 눈에 약간은 '짧아 보이는' 이상적인 썰매견의 다리 길이가 탄생했다. 출처: https://brunch.co.kr/@ossian/115 +) Keyword: weight pulling dogs source: https://robots.ieee.org/robot..

Complementary Filter for Two wheel System [내부링크]

sensor fusion technique: multiple sensors are used Complementary filter : Combines two sensor of having different frequency responses 1. Idea : to use appropriate filters for typical sensor characteristics to suppress the corresponding noises. : 일반적인 센서 특성에 적합한 필터를 사용하여 해당 노이즈를 억제하는 것 Sensor characteristics? the complementary filter consists of two filters lowpass filter for the tilt sensor high..

아두이노 function, map / constrain [내부링크]

constrain( value, min, max ); : 변수 value의 값을 min~max 사이의 값으로 한정한다.(최솟값 : min, 최댓값 : max) map( val, 0, 1023, min, max); : map함수은 analogRead의 return값을 min~max갑으로 매핑한다. i) constrain함수의 경우 만일 변수 value의 값이 min보다 낮은 값일 경우 min값을 반환하고, max보다 높은 값일 경우 max값을 반환하다. ii) map함수의 경우 예를들어 0~1023사이의 리턴값을 min~max로 매핑하게 된다. 예를들어 map( val, 200, 800, 0, 100);의 경우 200~800의 analogRead의 리턴값을 백분율( 0 ~ 100 )로 매핑하게 된다. ma..

인공지능_강화학습 - 1 [기본자료: 도서, 인터넷 자료] [내부링크]

- 처음 만나는 머신러닝과 딥러닝_저자: 오다카 토모히로 C 언어로 구형하며 익히는 기본 개념 - 강화학습 첫걸음_저자: 아서 줄리아니 텐서플로로 살펴보는 Q러닝, MDP, A3C 강화학습 알고리즘 - 단단한 강화학습_저자:리처드 서튼, 앤드류 바르토 [Reinforcement Learning - An Introduction, 2nd edition] 강화학습 기본 개념을 제대로 정리한 인공지능 교과서 - (+) 지도학습, 비지도학습 및 전반적인 인공지능 - 강화학습 Q-Learning 중 Q-Table(Tabular Methods) 출처: 웅이의 공간 - 강화학습 기초부터 DQN까지 (Reinforcement Learning from Basics to DQN) 출처: 박진우 - RL (강화학습) 기초 출..

벤자민 프랭클린 13가지 덕목 [내부링크]

1. 절제 : 배부르도록 먹지 마라. 취하도록 마시지 마라. Temperance : Eat not to dullness; drink not to elevation. 2. 침묵 : 자타에 이익을 주는 말만을 하고, 하찮은 대화는 피하라. Silence : Speak not but what may benefit others or yourself; avoid trifling conversation. 3. 질서 : 모든 물건은 제자리에 두라. 일은 모두 때를 정해서 하라. Order : Let all your things have their places; let each part of your business have its time. 4. 결단 : 해야 할 일은 결심하며, 게을리하지 말고 실행하라. Resol..

전자회로 #2 풀업저항 [내부링크]

출처 : https://kocoafab.cc/tutorial/view/526 실제로는 스위치가 열리게 될때는 0도 아니고 1도 아닌 0과 1사이에서 방황하는 아무런 상태도 아니게 됩니다. 그렇기 때문에 닫혀있을때는 전류가 흐르기 때문에 1을 출력하지만 열려있을때는 값이 이렇게 부유하고 있는 상태를 플로팅상태라고 합니다. 마치 0(LOW)과 1(HIGH)사이를 부유하고 있는 모습이죠. 이 플로팅 상태로 인해 일반적인 연결로는 스위치를 사용할 수 없습니다. 그렇기 때문에 스위치를 사용할때는 이번글에서 소개하려는 풀업, 풀다운 저항을 사용하여 연결해주어야 합니다. 위에서 본것과 같이 일반적인 연결로는 입출력핀에 아무런 신호가 가지 않을 경우 0도 아니고 1도 아닌 플로팅 상태를 가지기 때문에 이 문제를 해결해..

가속도,자이로 센서 동작, 사용하기_Gyro, Acceleration Sensor- 9DOF-IMU(AHRS) EBIMU-9DOFV3 (E2BOX) [내부링크]

AHRS EBIMU-9DOFV4 출처: E2BOX 기술정보 및 자료/EBIMU-9DOFV4 메뉴얼 시리얼 통신 터미널 프로그램 EBTerminal UART Protocol DataBit: 8 Data bits StopBit: 1 Stop bit Baudrate: 115200 bps (default) 1. roll / 2. pitch / 3.Yaw 아두이노 예제 ////////////////////// EBIMU FUNCTION ///////////////////////////// #define SBUF_SIZE 64 // 센서로 부터 수신된 1packet(1줄)을 저장하는 버퍼의 크기를 지정한다. // 1packet(1줄)당 수신된는 최대 바이트수 보다 크게 설정해야합니다. char sbuf[SBUF_S..

[독서법] 현승원 대표 [내부링크]

독서 < 삶 이대로 살겠다 (1회독) → 감명, 새로운 정보 [형광펜] “평관펜” 부분 읽기 → “다시는 잊지말자” [밑줄] “밑줄만” 읽기 → “인생으로 산다.” 부분 [노트에 필기] “노트” 읽기 then, “노트”를 수시로 읽기 다른 새로운 책을 읽기전에, 노트에 적었던 내용을 다시 읽고 시작 “독서후의 삶”, 그렇게 살았는가?

ROS기반 Q필터가 적용된 비선형외란관측기(DOB)를 모바일 로봇 [내부링크]

먼저, ROS는 로봇 운영체제(ROS, Robot Operating System)의 약자로, 로봇 소프트웨어 개발을 위한 오픈 소스 플랫폼입니다. ROS를 사용하면 로봇 관련 프로그램을 개발하고 실행할 수 있습니다. Q필터는 칼만 필터(Kalman Filter)의 일종으로, 선형 및 비선형 시스템에서 상태 추정 문제를 해결하는 데 사용됩니다. Q필터는 상태 변화 모델과 관측 모델을 사용하여 추정을 수행합니다. 비선형 외란 관측기는 Q필터를 적용하여 로봇의 위치 및 방향을 추정하는 데 사용됩니다. 이를 위해 먼저 로봇의 동작을 모델링하고, 로봇 센서의 출력을 측정하여 외란을 제거해야 합니다. 파이썬을 사용하여 ROS 기반 Q필터가 적용된 비선형 외란 관측기를 구현하려면 다음 단계를 따를 수 있습니다. RO..

ROS기반 sliding mode control 파이썬 코드 [내부링크]

우선, sliding mode control은 시스템의 모델을 모른 상태에서도 안정적인 제어가 가능한 방법 중 하나입니다. 이를 위해 보통은 시스템의 오차 상태를 추정하고, 추정된 오차 상태를 이용해 제어를 수행합니다. 이번 예시에서는 ROS의 rospy 모듈을 이용해 간단한 시뮬레이션을 수행하고, sliding mode control을 이용해 로봇을 제어하는 예제를 다루겠습니다. 먼저, 필요한 라이브러리를 설치합니다. pip install numpy matplotlib rospy 다음으로, **sliding_mode_control.py**라는 파일을 만들고, 아래의 코드를 입력합니다. #!/usr/bin/env python import rospy import numpy as np import matpl..

Simulation_turtlebot3 - Autorace(melodic) - 제어 [내부링크]

Simulation_turtlebot3 - Autorace(melodic) - 제어 코드 출처 https://github.com/ROBOTIS-GIT/turtlebot3_autorace_2020 실행 roslaunch turtlebot3_gazebo turtlebot3_autorace.launch roslaunch turtlebot3_autorace_camera intrinsic_camera_calibration.launch roslaunch turtlebot3_autorace_camera extrinsic_camera_calibration.launch roslaunch turtlebot3_autorace_detect detect_lane.launch roslaunch turtlebot3_autorace..

Simulation_turtlebot3 - Autorace(melodic, 18.04) [내부링크]

Simulation_turtlebot3 - Autorace(melodic) Install cd ~/catkin_ws/src/ git clone -b noetic-devel cd ~/catkin_ws && catkin_make sudo apt install ros-melodic-image-transport ros-melodic-cv-bridge ros-melodic-vision-opencv python3-opencv libopencv-dev ros-melodic-image-proc 실행 roslaunch turtlebot3_gazebo turtlebot3_autorace.launch roslaunch turtlebot3_autorace_camera intrinsic_camera_calibration.lau..

SSH로 접속해 Real_turtlebot3 with WSL2(melodic-18.04) [내부링크]

출처 SSH 서버 설치하기 WSL2[4] - SSH 접속하기 turtlebot - bringup https://emanual.robotis.com/docs/en/platform/turtlebot3/bringup/#bringup SSH 서버 설치하기 #패키지 업데이트하기 sudo apt update #SSH서버 설치하기 sudo apt install openssh-server #ssh셋팅하기 sudo systemctl enable ssh #net-tools 설치 sudo apt install net-tools #ip주소 확인 ifconfig #호스트키 생성 sudo ssh-keygen -A #비밀번호 인증방식 사용 sudo nano /etc/ssh/sshd_config #다음 내용을 수정합니다. Passw..

WSL2 + ROS2 [Simulation_turtlebot3 - SLAM] (터틀봇3 슬램) [내부링크]

Simulation_turtlebot3 - SLAM(터틀봇3 슬램) Launch Simulation World - Gazebo export TURTLEBOT3_MODEL=burger ros2 launch turtlebot3_gazebo turtlebot3_world.launch.py Run SLAM Node - Rviz2 export TURTLEBOT3_MODEL=burger ros2 launch turtlebot3_cartographer cartographer.launch.py use_sim_time:=True Run Teleoperation Node - keyboard export TURTLEBOT3_MODEL=burger ros2 run turtlebot3_teleop teleop_keyboard ..

WSL2 + ROS2 [Simulation_turtlebot3- Gazebo], 에러 해결 [내부링크]

Launch Simulation Package export TURTLEBOT3_MODEL=burger ros2 launch turtlebot3_gazebo empty_world.launch.py 에러 해결 출처 package 'turtlebot3_gazebo' not found, searching: ['/opt/ros/foxy'] Error, 에러 코드 Package 'turtlebot3_gazebo' not found: "package 'turtlebot3_gazebo' not found, searching: ['/opt/ros/foxy']" Error → Solution sudo apt install ros-foxy-turtlebot3-gazebo set env export TURTLEBOT3_MOD..

WSL2 + ROS2 [Simulation_turtlebot3 - Navigation] (터틀봇3 네비게이션) [내부링크]

출처 ROBOTIS e-Manual - 준비물 : SLAM에서 실행한 map 정보에 대한 파일 (map.yaml) Launch Simulation World export TURTLEBOT3_MODEL=burger ros2 launch turtlebot3_gazebo turtlebot3_world.launch.py Run Navigation Node export TURTLEBOT3_MODEL=burger ros2 launch turtlebot3_navigation2 navigation2.launch.py use_sim_time:=True map:=$HOME/map.yaml Estimate Initial Pose ros2 run turtlebot3_teleop teleop_keyboard Set Naviga..

WSL2 + ROS2 [Simulation_turtlebot3 - Gazebo] [내부링크]

Simulation_turtlebot3 - Gazebo 출처 ROBOTIS e-Manual Install ROS on PC wget sudo chmod 755 ./install_ros2_foxy.sh bash ./install_ros2_foxy.sh Install Dependent ROS 2 Packages sudo apt-get install ros-foxy-gazebo-* sudo apt install ros-foxy-cartographer sudo apt install ros-foxy-cartographer-ros sudo apt install ros-foxy-navigation2 sudo apt install ros-foxy-nav2-bringup Install TurtleBot3 Packages..

WSL2 + ROS2 [Uninstall] 제거 [내부링크]

ROS2 - Uninstall 출처 Ubuntu (Debian) — ROS 2 Documentation: Foxy documentation sudo apt remove ~nros-foxy-* && sudo apt autoremove sudo rm /etc/apt/sources.list.d/ros2.list sudo apt update sudo apt autoremove # Consider upgrading for packages previously shadowed. sudo apt upgrade

WSL2 + ROS2 [Setup] 환경 설치 [내부링크]

ROS2 공식 홈페이지 설치 과정 - 출처 Ubuntu (Debian) — ROS 2 Documentation: Foxy documentation Resources Status Page: ROS 2 Foxy (Ubuntu Focal): amd64, arm64 Jenkins Instance Repositories Set locale locale # check for UTF-8 sudo apt update && sudo apt install locales sudo locale-gen en_US en_US.UTF-8 sudo update-locale LC_ALL=en_US.UTF-8 LANG=en_US.UTF-8 export LANG=en_US.UTF-8 locale # verify settings Set S..

[review] 자전거 강화학습 - 본문 [내부링크]

Reference Controller Learning Method of Self-driving Bicycle Using State-of-the-art Deep Reinforcement Learning Algorithms DeepDeterministicPolicyGradient알고리즘을응용한자전거의자율주행제어 Self-Balancing and Autonomous Driving Control Method for Bicycle using Deep Reinforcement Learning 2. Preliminaries Related works MDP(Markov Decision Process) and Reinforcement Learning 강화학습? → 보상 값으로 부터 학습을 하는데 중점 (기계학습의 한 종..

[review] 자전거 강화학습 - Intro [내부링크]

Reference Controller Learning Method of Self-driving Bicycle Using State-of-the-art Deep Reinforcement Learning Algorithms DeepDeterministicPolicyGradient알고리즘을응용한자전거의자율주행제어 Self-Balancing and Autonomous Driving Control Method for Bicycle using Deep Reinforcement Learning 1. Introduction 강화학습 연구 사례 [4] J. Tan, Y. Gu, C. K. Liu, and G. Turk, “Learning bicycle stunts,” ACM Transactions on Graphics ..