Main Content

이 번역 페이지는 최신 내용을 담고 있지 않습니다. 최신 내용을 영문으로 보려면 여기를 클릭하십시오.

특화된 메시지

특화된 센서 및 입력에서 메시지에 액세스

특화된 메시지 함수를 사용하면 특정 ROS 메시지 유형과 ROS 2 메시지 유형을 사용해 센서와 데이터형을 생성하고 액세스할 수 있습니다. 또한 동일한 함수를 사용하여 ROS 및 ROS 2에 특화된 특정 메시지 유형으로 작업할 수 있습니다. 이러한 센서에서 데이터에 액세스하는 예제는 Work with Specialized ROS Messages 항목을 참조하십시오.

함수

모두 확장

rosReadImageConvert ROS or ROS 2 image data into MATLAB image (R2021a 이후)
rosWriteImageWrite MATLAB image to ROS or ROS 2 image message (R2021a 이후)
rosWriteCameraInfoWrite monocular or stereo camera parameters to ROS or ROS 2 message structure (R2022a 이후)
rosReadLidarScanROS 또는 ROS 2 메시지 구조체에서 라이다 스캔 또는 포인트 클라우드 표시 (R2021a 이후)
rosReadCartesianRead laser scan ranges in Cartesian coordinates from ROS or ROS 2 message structure (R2021a 이후)
rosReadScanAnglesReturn scan angles from ROS or ROS 2 message structure (R2021a 이후)
rosPlotDisplay lidar scan or point cloud from ROS or ROS 2 message structures (R2021a 이후)
rosReadXYZROS 또는 ROS 2 포인트 클라우드 메시지 구조체에서 XYZ 좌표 추출 (R2021a 이후)
rosWriteXYZWrite data points in x, y and z coordinates to a ROS or ROS 2 PointCloud2 message structure (R2023a 이후)
rosReadRGBROS 또는 ROS 2 포인트 클라우드 메시지 구조체에서 RGB 색 값 추출 (R2021a 이후)
rosWriteRGBWrite RGB color information to a ROS or ROS 2 PointCloud2 message structure (R2023a 이후)
rosReadAllFieldNamesGet all available field names from ROS or ROS 2 point cloud message structure (R2021a 이후)
rosReadFieldRead point cloud data from ROS or ROS 2 message structure based on field name (R2021a 이후)
rosWriteIntensityWrite intensity data points to a ROS or ROS 2 PointCloud2 message structure (R2023a 이후)
rosPlotDisplay lidar scan or point cloud from ROS or ROS 2 message structures (R2021a 이후)
rosReadQuaternionCreate MATLAB quaternion object from ROS or ROS 2 message structure (R2021a 이후)
quaternion쿼터니언 배열 생성
rosReadBinaryOccupancyGridRead binary occupancy grid data from ROS or ROS 2 message structure (R2021a 이후)
rosReadOccupancyGridRead occupancy grid data from ROS or ROS 2 message structure (R2021a 이후)
rosReadOccupancyMap3DRead 3-D map from ROS or ROS 2 Octomap message structure (R2021a 이후)
rosWriteBinaryOccupancyGridWrite values from binary occupancy grid to ROS or ROS 2 message structure (R2021a 이후)
rosWriteOccupancyGridWrite values from occupancy grid to ROS or ROS 2 message structure (R2021a 이후)
rosReadTransformReturn transformation from ROS or ROS 2 TransformStamped message structure (R2023b 이후)
rosApplyTransformTransform ROS and ROS 2 message entities into target frame (R2021a 이후)
se3SE(3) homogeneous transformation (R2023b 이후)
so3SO(3) rotation (R2023b 이후)
se2SE(2) homogeneous transformation (R2023b 이후)
so2SO(2) rotation (R2023b 이후)
velodyneROSMessageReaderRead Velodyne ROS messages (R2020b 이후)
hasFrameDetermine if another Velodyne point cloud is available in the ROS messages (R2020b 이후)
readFrameRead point cloud frame from ROS message (R2020b 이후)
resetReset CurrentTime property of velodyneROSMessageReader object to default value (R2020b 이후)

블록

ROS Apply Transform, ROS 2 Apply TransformTransform input ROS or ROS 2 message to target frame (R2023b 이후)
Get TransformGet transformation between source and target frame from ROS network (R2023b 이후)
Get TransformGet transformation between source and target frame from ROS 2 network (R2023b 이후)
Read ImageExtract image from ROS Image message (R2019b 이후)
Read ImageExtract image from ROS 2 Image message (R2021b 이후)
ROS Read Scan, ROS 2 Read ScanExtract scan data from ROS or ROS 2 laser scan message (R2022a 이후)
Read Point CloudExtract point cloud from ROS PointCloud2 message (R2019b 이후)
Read Point CloudExtract point cloud from ROS 2 PointCloud2 message (R2021b 이후)
ROS Write Image, ROS 2 Write ImageWrite image data to a ROS or ROS 2 message (R2022a 이후)
ROS Write Point Cloud, ROS 2 Write Point CloudWrite point cloud data to a ROS or ROS 2 message (R2022a 이후)

도움말 항목

특화된 ROS 메시지