-
Notifications
You must be signed in to change notification settings - Fork 14
Atlas MultiSense SL head
이번 장에서는 rviz 사용해 시뮬레이션된 MultiSense SL 센서로 부터 기본적인 센서 스트림 시각화에 대해 소개한다.
Atlas robot simulation을 시작하여라:
roslaunch drcsim_gazebo atlas.launch
rviz를 시작하여라.
rosrun rviz rviz
그리고 this tutorial를 통해 적절하게 rviz를 구성하여라.
카메라와 레이저 시각화 셋업 단계를 다시 반복하여라. ROS 토픽을 아래와 같이 변경하여라.
- camera image streams:
/multisense_sl/camera/left/image_raw
and/multisense_sl/camera/right/image_raw
for left and right eye. - LIDAR data stream:
/multisense_sl/laser/scan
For drcsim >= 4.1.0: atlas versions >= v3 (e.g. atlas_v3.launch)은 카메라와 레이저 토픽이 아래와 같이 바뀌어야 된다:
- camera image streams:
/multisense/camera/left/image_raw
and/multisense/camera/right/image_raw
for left and right eye. - LIDAR data stream:
/multisense/lidar_scan
카메라 이미지와 레이저 데이터 시각화 뿐만 아니라, stereo point cloud를 시각화 하기 위해서는 rviz Displays 패널 아래의 Add
버튼을 클릭하여 PointCloud2
를 선택하고 OK
를 클릭한다. 새롭게 추가된 PointCloud2 시각화를 위한 토픽을 /multisense_sl/camera/points2
같이 셋팅 한다. 이제 rviz에서 point cloud 시각화를 보기 위해서 로봇 앞에 박스를 떨어뜨려라.
LIDAR spindle의 회전 스피드 명령어를 셋팅 하기 위해 새로운 터미널 창을 열고 다음 명령어를 기입 하여라.
rostopic pub --once /multisense_sl/set_spindle_speed std_msgs/Float64 '{data: 3.0}'
For drcsim >= 4.1.0: atlas versions >= v3 (e.g. atlas_v3.launch)을 사용한다면 다음의 명령어를 대신 사용 하여야 한다.
rostopic pub --once /multisense/set_spindle_speed std_msgs/Float64 '{data: 3.0}'
rviz display 패널의 LaserScan
아래에 Decay Time
을 5초로 설정하여라.
-
Robot Simulators
-
Build a Robot
- Model structure and requirements
- How to contribute a model
- Make a model
- Make a Mobile Robot
- The relationship among Link, Joint and Axis
- Import Meshes
- Attach Meshes
- Add a Sensor to a Robot
- Make a Simple Gripper
- Attach Gripper to Robot
- Nested model
- Model Editor
- Animated Box
- Make an animated model(actor)
- Inertial parameters of triangle meshes
- Visibility layers
-
Model Editor
-
Build a World
-
Tools and utilities
-
Write a plugin
-
Plugins
-
Sensors
-
User input
-
Transport Library
-
Rendering Library
-
Connect to ROS
-
Ros Control - Advanced
-
DRCSIM for ROS Kinetic (Ubuntu16.04)
-
DRCSIM
- DRC Simulator installation
- Launchfile options
- Spawn Atlas into a custom world
- Animate joints
- Atlas Keyboard Teleoperation over ROS
- Teleoperate atlas with a music mixer
- Visualization and logging
- Atlas MultiSense SL head
- How to use the Atlas Sim Interface
- Atlas fake walking
- Grasp with Sandia hands
- DRC vehicle tele-operation
- DRC vehicle tele operation with Atlas
- Sending joint commands with ROS
- Atlas control over ROS with python
- Modify environment
- Atlas switching control modes
- Atlas Controller Synchronization over ROS Topics
- Changing Viscous Damping Coefficients Over ROS Service
- Running BDI controller demo
- Using the RobotiQ 3 Finger Adaptive Robot Gripper
- BDI Atlas Robot Interface 3.0.0 Stand In Example
-
HAPTIX
- HAPTIX software install and update
- HAPTIX C API
- HAPTIX Matlab and Octave API
- HAPTIX Simulation World API
- HAPTIX Teleoperation
- HAPTIX environment setup
- HAPTIX Optitrack Control
- HAPTIX Tactor Glove
- HAPTIX Simulation World API with Custom World Example
- HAPTIX logging
- HAPTIX DEKA Luke hand installation
- HAPTIX Simulation Scoring Plugin Example
-
MoveIt!
-
Rviz & rqt & ROSBAG
- Control Theory
- TroubleShooting
- Solidworks model to URDF
- ROS-Gazebo with MATLab
- MATLab installation in Linux
- [Gazebo simulation with MATLab]