설치 명령어$ sudo apt-get install mosquitto$ sudo apt-get install mosquitto-clients테스트 1. 브로커에서 서브스크라이브하는 명령어 mosquitto_sub -h 127.0.0.1 -t test로컬 호스트(127.0.0.1) 브로커에 연결함. 토픽이름은 test. 2. 브로커에 퍼블리쉬하는 명령어 (앞 명령어와 다른 터미널에서 실행할 것. )mosquitto_pub -h 127.0.0.1 -t test -m "hello"Test라는 토픽에 hello라는 문자를 발행함.
분류 전체보기
ls -l /dev | grep ttyUSB/dev : 파일은 아니지만 파일인 것처럼 커널에서 실행중인 드라이버의 결과 실행 결과는 다음과 같이 나옴. crw-rw--- 1 root dialout 188 여기서 root는 사용자, dialout은 그룹임. 이 결과를 통해 읽고 쓰기 기능이 permision되었는지 확인할 수 있음. lsusbUSB 장치 목록을 볼 수 있는 명령어. 'ID' 다음에 나오는 4개의 문자가 vendor ID이고, ':' 다음에 나오는 4개의 문자가 product ID임. 예를 들어, Bus 001 Device 003: ID 03T2:9231 Future Technology Devices ~~~~라고 나오면 여기서 Vendor ID = 03T2가 되고, Product ID = ..
1. Using nav_msgs/Odometry => Publishing odometry information over ROSreference: http://wiki.ros.org/navigation/Tutorials/RobotSetup/Odom #include #include #include int main(int argc, char** argv){ ros::init(argc, argv, "odometry_publisher"); ros::NodeHandle n; ros::Publisher odom_pub = n.advertise("odom", 50); tf::TransformBroadcaster odom_broadcaster; double x = 0.0; double y = 0.0; dou..

vcc-5vgnd-gnddat-sdaclk-clk Jetson xavierpin 3 = I2C1_SDApin 5= I2C1_SCL=> I2C BUS 8 Download i2c tools$ sudo apt-get install libi2c-dev i2c-toolsGet permission $ sudo chmod 666 /dev/i2c-1add your user to the i2c group$ sudo usermod -a -G i2c $USERcheck able i2c (code default = /dev/i2c-1)$ i2cdetect -l$ ls /dev/i2c* check address (code default = 0x28)$ sudo i2cdetect -y 8$ sudo i2cdetect -y -r ..
0. My environment- Ubuntu 18.04- ROS melodic 1. git clone rplidar source$ cd catkin_ws/src$ git clone https://github.com/Slamtec/rplidar_ros$ cd ..$ catkin_make2. source bash$ source ~/catkin_ws/devel/setup.bash3. Get permision USB$ ls /dev/ttyUSB*$ sudo chmod 0666 /dev/ttyUSB04. Test$ roslaunch rplidar_ros view_rplidar.launch Reference:https://github.com/Slamtec/rplidar_ros GitHub - Slamtec/rpl..
IPA coverage planning form fraunhofer ipa github: https://github.com/ipa320/ipa_coverage_planning GitHub - ipa320/ipa_coverage_planning: Algorithms for floor plan segmentation and systematic coverage driving patterns Algorithms for floor plan segmentation and systematic coverage driving patterns - GitHub - ipa320/ipa_coverage_planning: Algorithms for floor plan segmentation and systematic covera..