질문 할 거
CMAKE란 무엇일까
SDK 사용하는 거랑 Wrapper 사용하는 것의 차이가 무엇을까
https://dev.intelrealsense.com/docs/compiling-librealsense-for-linux-ubuntu-guide
다 때려넣은 librealsense2.so and pyrealsense2.so의 적당한 이름이 뭘까
해야할 거
Bert 논문 리뷰 참고 자료
https://catsirup.github.io/ai/2020/04/20/bert.html
[논문 뽀개기] BERT: Pre-training of Deep Bidirectional Transformers for Language Understanding
보면 볼수록 귀엽단 말이지
catsirup.github.io
세미나 발표 참고 자료
https://arxiv.org/pdf/2212.10560.pdf
[리뷰] Meta LLaMA의 친척 — Stanford Univ의 Alpaca
Llama와 Alpaca를 구별할 수 있는가? Llama와 Alpaca는 모두 남아메리카의 낙타과 동물로 Llama는 주로 화물 운반용으로, Alpaca는 털을 얻기 위한 목적으로 길들어진 동물이다. Llama는 Alpaca에 비해 체격이
moon-walker.medium.com
https://lsjsj92.tistory.com/656
OpenAI GPT Fine-Tuning(파인튜닝) 방법 정리 - 나만의 GPT 모델 만들기
포스팅 개요최근 OpenAI의 ChatGPT가 각광을 받으면서 대규모 언어 모델(LLM, Large Language Model)이 주목 받고 있습니다. 이전 포스팅에서는 이러한 LLM 모델, 그 중 chatgpt의 전신이 되는 gpt3.5를 활용하기
lsjsj92.tistory.com
리눅스 패키지 목록보기
dpkg --get-selections
ROS
ROS Publisher 코드 설명
https://doljokilab.tistory.com/16
[ROS] talker.py(Publisher) 코드 분석하기
#!/usr/bin/env python import rospy from std_msgs.msg import String def talker(): pub = rospy.Publisher('chatter', String, queue_size=10) rospy.init_node('talker', anonymous=True) rate = rospy.Rate(10) # 10hz while not rospy.is_shutdown(): hello_str = "hell
doljokilab.tistory.com
ROS MASTER 통신 - 두 대의 디바이스를 연결할 때 PING을 꼭 해봐야하는 이유
https://m.blog.naver.com/gkdud4797/222040887527
ROS MASTER 통신 - 두 대의 디바이스를 연결할 때 PING을 꼭 해봐야하는 이유
ROS는 기본적으로 TCP/IP통신을 기반으로 만들어졌기 때문에 간단하게(?) 여러 디바이스간에 통신...
blog.naver.com
ROS 강의
https://www.youtube.com/watch?v=-vVgGpWY0Ps&list=PLRG6WP3c31_VIFtFAxSke2NG_DumVZPgw&index=14
ROS 블로그
오픈소스 소프트웨어 & 하드웨어: 로... : 네이버 카페
오픈소스 소프트웨어/하드웨어로 만드는 로봇 기술 공유 카페 (ROS,ARM,AVR,mbed,라즈베리파이,아두이노)
cafe.naver.com
ROS TF 에 관한 설명
https://velog.io/@7cmdehdrb/whatIsTF
초보자를 위한 ROS : TF란 무엇인가
ROS를 이용한 프로그래밍에서 매우 중요한 frame과 TF(Transform)에 대하여 알아보자. TF란 무엇일까?
velog.io
REAL SENSE
Realsense 공식 깃허브
https://github.com/IntelRealSense/librealsense
GitHub - IntelRealSense/librealsense: Intel® RealSense™ SDK
Intel® RealSense™ SDK. Contribute to IntelRealSense/librealsense development by creating an account on GitHub.
github.com
Depth 카메라 정보 ethernet_client_server로 받기
GitHub - IntelRealSense/librealsense: Intel® RealSense™ SDK
Intel® RealSense™ SDK. Contribute to IntelRealSense/librealsense development by creating an account on GitHub.
github.com
Depth 카메라로 Position Detection 하는 논문 자료
https://www.hindawi.com/journals/amp/2022/9170642/
Human Position Detection Based on Depth Camera Image Information in Mechanical Safety
The devices used for human position detection in mechanical safety mainly include safety light curtain, safety laser scanner, safety pad, and vision system. However, these devices may be bypassed when used, and human or equipment cannot be distinguished. T
www.hindawi.com
논문 다운로드
https://downloads.hindawi.com/journals/amp/2022/9170642.pdf
Depth 카메라 여러개로 Human motion Tracking 하는 논문 자료
https://ieeexplore.ieee.org/stamp/stamp.jsp?tp=&arnumber=6385968
Real-time human motion tracking using multiple depth cameras
In this paper, we consider the problem of tracking human motion with a 22-DOF kinematic model from depth images. In contrast to existing approaches, our system naturally scales to multiple sensors. The motivation behind our approach, termed Multiple Depth
ieeexplore.ieee.org
LiDAR 카메라로 Human Tracking 하는 자료
https://digitalmortar.com/lidar-technology-for-people-tracking-a-detailed-look/
Lidar Technology for People-Tracking : A Detailed Look | Digital Mortar
LiDAR Technology has a number of unique properties that make it well suited to certain applications of people-tracking and journey measurement. LiDAR sensors have gained a lot of notoriety from their use in automotive self-driving applications and they’v
digitalmortar.com
Depth 카메라 이용한 랩실 Github
https://github.com/AIRLABkhu/Manuals
GitHub - AIRLABkhu/Manuals
Contribute to AIRLABkhu/Manuals development by creating an account on GitHub.
github.com
realsense Python 예시 Github
https://github.com/IntelRealSense/librealsense/tree/master/wrappers/python/examples
GitHub - IntelRealSense/librealsense: Intel® RealSense™ SDK
Intel® RealSense™ SDK. Contribute to IntelRealSense/librealsense development by creating an account on GitHub.
github.com
PointCloud ROS 예시
https://dev.intelrealsense.com/docs/pointcloud-visualization
PointCloud ROS Examples
PointCloud visualizationThis example demonstrates how to start the camera node and make it publish point cloud using the pointcloud option.Shellroslaunch realsense2_camera rs_camera.launch filters:=pointcloud Then open rviz to watch the pointcloud: The fol
dev.intelrealsense.com
https://dev.intelrealsense.com/docs/object-analytics
Object Analytics
Object Analytics (OA) is ROS wrapper for real-time object detection, localization and tracking. These packages aim to provide real-time object analyses over RGB-D camera inputs, enabling ROS developer to easily create amazing robotics advanced features, li
dev.intelrealsense.com
Pyrealsense2.config 라이브러리 설명
pyrealsense2.config — pyrealsense2 2.33.1 documentation
Resolve the configuration filters, to find a matching device and streams profiles. The method resolves the user configuration filters for the device and streams, and combines them with the requirements of the computer vision modules and processing blocks a
intelrealsense.github.io
Pyrealsense2.pipeline 라이브러리 설명
pyrealsense2.pipeline — pyrealsense2 2.33.1 documentation
Wait until a new set of frames becomes available. The frames set includes time-synchronized frames of each enabled stream in the pipeline. In case of different frame rates of the streams, the frames set include a matching frame of the slow stream, which ma
intelrealsense.github.io
Intel 공식사이트
https://www.intelrealsense.com/support/
Support
Having trouble getting started with your Intel RealSense camera? Running into roadblocks? We are here to help.
www.intelrealsense.com
https://www.intelrealsense.com/get-started-depth-camera/
Get Started with Intel® RealSense™D400 Series depth camera
Congratulations! Now that you’ve got your Intel® RealSense™ depth camera, start using it by following these simple steps.
www.intelrealsense.com
SDK Knowledge base
SDK 2.0 CODE SAMPLES WRAPPERS AND LANGUAGES
https://dev.intelrealsense.com/docs/stream-over-ethernet-python-example
Stream over Ethernet - Python Example
Ethernet client and server for RealSense using python's Asyncore.PrerequisitesInstallation and Setup of Server:These steps assume a fresh install of Ubuntu 18.04 on an UpBoard but has also been tested on an Intel NUC.sudo apt-get update; sudo apt-get upgra
dev.intelrealsense.com
Box Measurement and Multi-camera Calibration
https://dev.intelrealsense.com/docs/box-measurement-and-multi-camera-calibration
Box Measurement and Multi-camera Calibration
This sample demonstrates the ability to use the SDK for aligning multiple devices to a unified co-ordinate system in world to solve a simple task such as dimension calculation of a box.RequirementsThis code requires Python 3.6 to work and does not work wit
dev.intelrealsense.com
rviz 관련
http://wiki.ros.org/rviz/DisplayTypes/Path
rviz/DisplayTypes/Path - ROS Wiki
The Path display shows a nav_msgs/Path as a line strip. Properties Name Description Valid Values Default Color The color of the line ([0-255], [0-255], [0-255]) (25, 255, 0) Alpha The amount of transparency to apply to the line [0-1] 1 Topic The topic to s
wiki.ros.org
Pyrealsense2 패키지 정보
https://github.com/IntelRealSense/librealsense/blob/development/doc/distribution_linux.md
GitHub - IntelRealSense/librealsense: Intel® RealSense™ SDK
Intel® RealSense™ SDK. Contribute to IntelRealSense/librealsense development by creating an account on GitHub.
github.com
REAlsense D455 스펙
https://www.intelrealsense.com/depth-camera-d455/
Introducing the Intel® RealSense™ Depth Camera D455
Twice the Range. Better Performance. IMU. Global Shutter RGB. Up to 4 m with Z-Error < 2%. On-chip calibration.
www.intelrealsense.com
OPEN_CR
https://m.blog.naver.com/PostView.naver?isHttpsRedirect=true&blogId=jaydee88&logNo=221313830058
초보의 OpenCR 보드로 Dynamixel 구동해보기
얼마전에 우리 연구소에서 구입한 장비중에 OpenCR 과 Dynamixel(다이나믹셀)이라는 친구가 있다....
blog.naver.com
'Robotics > ROS' 카테고리의 다른 글
[Robotics] ROS 다운로드 및 환경 설정(+python 예제 코드) (0) | 2023.05.18 |
---|---|
[Robotics] ROS 압축정리 (1) : ROS환경 설정 ~ ROS Topic까지 (0) | 2023.04.18 |
[Robotics] Depth camera 정보 python에 받아오기 (0) | 2023.04.07 |
[Robotics] Depth Camera Rviz 띄워보기 (0) | 2023.04.06 |
[Robotics] 기존 프로젝트 분석 (0) | 2023.04.05 |