34 #include <arpa/inet.h>
36 #include <turbojpeg.h>
38 #include <Eigen/Geometry>
39 #include <opencv2/opencv.hpp>
46 #include <multisense_lib/MultiSenseChannel.hh>
48 #include <multisense_ros/RawCamConfig.h>
49 #include <multisense_ros/RawCamCal.h>
50 #include <multisense_ros/DeviceInfo.h>
51 #include <multisense_ros/Histogram.h>
94 {
reinterpret_cast<Camera*
>(userDataP)->monoCallback(header); }
96 {
reinterpret_cast<Camera*
>(userDataP)->rectCallback(header); }
98 {
reinterpret_cast<Camera*
>(userDataP)->depthCallback(header); }
100 {
reinterpret_cast<Camera*
>(userDataP)->pointCloudCallback(header); }
102 {
reinterpret_cast<Camera*
>(userDataP)->rawCamDataCallback(header); }
104 {
reinterpret_cast<Camera*
>(userDataP)->colorImageCallback(header); }
106 {
reinterpret_cast<Camera*
>(userDataP)->disparityImageCallback(header); }
108 {
reinterpret_cast<Camera*
>(userDataP)->jpegImageCallback(header); }
110 {
reinterpret_cast<Camera*
>(userDataP)->histogramCallback(header); }
111 void colorizeCB(
const image::Header& header,
void* userDataP)
112 {
reinterpret_cast<Camera*
>(userDataP)->colorizeCallback(header); }
113 void groundSurfaceCB(
const image::Header& header,
void* userDataP)
114 {
reinterpret_cast<Camera*
>(userDataP)->groundSurfaceCallback(header); }
116 {
reinterpret_cast<Camera*
>(userDataP)->groundSurfaceSplineCallback(header); }
123 constexpr
char Camera::LEFT[];
124 constexpr
char Camera::RIGHT[];
125 constexpr
char Camera::AUX[];
126 constexpr
char Camera::CALIBRATION[];
127 constexpr
char Camera::GROUND_SURFACE[];
129 constexpr
char Camera::ORIGIN_FRAME[];
130 constexpr
char Camera::HEAD_FRAME[];
131 constexpr
char Camera::LEFT_CAMERA_FRAME[];
132 constexpr
char Camera::RIGHT_CAMERA_FRAME[];
133 constexpr
char Camera::LEFT_RECTIFIED_FRAME[];
134 constexpr
char Camera::RIGHT_RECTIFIED_FRAME[];
135 constexpr
char Camera::AUX_CAMERA_FRAME[];
136 constexpr
char Camera::AUX_RECTIFIED_FRAME[];
138 constexpr
char Camera::DEVICE_INFO_TOPIC[];
139 constexpr
char Camera::RAW_CAM_CAL_TOPIC[];
140 constexpr
char Camera::RAW_CAM_CONFIG_TOPIC[];
141 constexpr
char Camera::RAW_CAM_DATA_TOPIC[];
142 constexpr
char Camera::HISTOGRAM_TOPIC[];
143 constexpr
char Camera::MONO_TOPIC[];
144 constexpr
char Camera::RECT_TOPIC[];
145 constexpr
char Camera::DISPARITY_TOPIC[];
146 constexpr
char Camera::DISPARITY_IMAGE_TOPIC[];
147 constexpr
char Camera::DEPTH_TOPIC[];
148 constexpr
char Camera::OPENNI_DEPTH_TOPIC[];
149 constexpr
char Camera::COST_TOPIC[];
150 constexpr
char Camera::COLOR_TOPIC[];
151 constexpr
char Camera::RECT_COLOR_TOPIC[];
152 constexpr
char Camera::POINTCLOUD_TOPIC[];
153 constexpr
char Camera::COLOR_POINTCLOUD_TOPIC[];
154 constexpr
char Camera::ORGANIZED_POINTCLOUD_TOPIC[];
155 constexpr
char Camera::COLOR_ORGANIZED_POINTCLOUD_TOPIC[];
156 constexpr
char Camera::MONO_CAMERA_INFO_TOPIC[];
157 constexpr
char Camera::RECT_CAMERA_INFO_TOPIC[];
158 constexpr
char Camera::COLOR_CAMERA_INFO_TOPIC[];
159 constexpr
char Camera::RECT_COLOR_CAMERA_INFO_TOPIC[];
160 constexpr
char Camera::DEPTH_CAMERA_INFO_TOPIC[];
161 constexpr
char Camera::DISPARITY_CAMERA_INFO_TOPIC[];
162 constexpr
char Camera::COST_CAMERA_INFO_TOPIC[];
163 constexpr
char Camera::GROUND_SURFACE_IMAGE_TOPIC[];
164 constexpr
char Camera::GROUND_SURFACE_INFO_TOPIC[];
165 constexpr
char Camera::GROUND_SURFACE_POINT_SPLINE_TOPIC[];
167 Camera::Camera(
Channel* driver,
const std::string& tf_prefix) :
170 left_nh_(device_nh_, LEFT),
171 right_nh_(device_nh_, RIGHT),
172 aux_nh_(device_nh_, AUX),
173 calibration_nh_(device_nh_, CALIBRATION),
174 ground_surface_nh_(device_nh_, GROUND_SURFACE),
175 left_mono_transport_(left_nh_),
176 right_mono_transport_(right_nh_),
177 left_rect_transport_(left_nh_),
178 right_rect_transport_(right_nh_),
179 left_rgb_transport_(left_nh_),
180 left_rgb_rect_transport_(left_nh_),
181 depth_transport_(device_nh_),
182 ni_depth_transport_(device_nh_),
183 disparity_left_transport_(left_nh_),
184 disparity_right_transport_(right_nh_),
185 disparity_cost_transport_(left_nh_),
186 aux_mono_transport_(aux_nh_),
187 aux_rgb_transport_(aux_nh_),
188 aux_rect_transport_(aux_nh_),
189 aux_rgb_rect_transport_(aux_nh_),
190 ground_surface_transport_(ground_surface_nh_),
191 stereo_calibration_manager_(nullptr),
192 frame_id_origin_(tf_prefix + ORIGIN_FRAME),
193 frame_id_head_(tf_prefix + HEAD_FRAME),
194 frame_id_left_(tf_prefix + LEFT_CAMERA_FRAME),
195 frame_id_right_(tf_prefix + RIGHT_CAMERA_FRAME),
196 frame_id_aux_(tf_prefix + AUX_CAMERA_FRAME),
197 frame_id_rectified_left_(tf_prefix + LEFT_RECTIFIED_FRAME),
198 frame_id_rectified_right_(tf_prefix + RIGHT_RECTIFIED_FRAME),
199 frame_id_rectified_aux_(tf_prefix + AUX_RECTIFIED_FRAME),
200 static_tf_broadcaster_(),
201 pointcloud_max_range_(15.0),
204 border_clip_value_(0.0)
210 if (Status_Ok != status) {
211 ROS_ERROR(
"Camera: failed to query version info: %s", Channel::statusString(status));
216 if (Status_Ok != status) {
217 ROS_ERROR(
"Camera: failed to query device info: %s", Channel::statusString(status));
226 if (Status_Ok != status) {
227 ROS_ERROR(
"Camera: failed to query sensor configuration: %s", Channel::statusString(status));
417 const auto point_cloud_color_topics =
has_aux_camera_ ? Source_Luma_Rectified_Aux | Source_Chroma_Rectified_Aux :
418 Source_Luma_Left | Source_Chroma_Left;
422 Source_Disparity | point_cloud_color_topics),
424 Source_Disparity | point_cloud_color_topics));
428 Source_Disparity | point_cloud_color_topics),
430 Source_Disparity | point_cloud_color_topics));
488 multisense_ros::DeviceInfo
msg;
497 msg.pcbSerialNumbers.push_back(pcb.revision);
498 msg.pcbNames.push_back(pcb.name);
539 if (Status_Ok != status) {
540 ROS_ERROR(
"Camera: failed to query image calibration: %s",
541 Channel::statusString(status));
547 multisense_ros::RawCamCal cal;
550 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
M[0][0]));
551 for(uint32_t i=0; i<9; i++) cal.left_M[i] = cP[i];
552 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
D[0]));
553 for(uint32_t i=0; i<8; i++) cal.left_D[i] = cP[i];
554 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
R[0][0]));
555 for(uint32_t i=0; i<9; i++) cal.left_R[i] = cP[i];
556 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
P[0][0]));
557 for(uint32_t i=0; i<12; i++) cal.left_P[i] = cP[i];
562 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
M[0][0]));
563 for(uint32_t i=0; i<9; i++) cal.right_M[i] = cP[i];
564 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
D[0]));
565 for(uint32_t i=0; i<8; i++) cal.right_D[i] = cP[i];
566 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
R[0][0]));
567 for(uint32_t i=0; i<9; i++) cal.right_R[i] = cP[i];
568 cP =
reinterpret_cast<const float *
>(&(image_calibration.
left.
P[0][0]));
569 for(uint32_t i=0; i<12; i++) cal.right_P[i] = cP[i];
573 cP =
reinterpret_cast<const float *
>(&(image_calibration.
right.
M[0][0]));
574 for(uint32_t i=0; i<9; i++) cal.right_M[i] = cP[i];
575 cP =
reinterpret_cast<const float *
>(&(image_calibration.
right.
D[0]));
576 for(uint32_t i=0; i<8; i++) cal.right_D[i] = cP[i];
577 cP =
reinterpret_cast<const float *
>(&(image_calibration.
right.
R[0][0]));
578 for(uint32_t i=0; i<9; i++) cal.right_R[i] = cP[i];
579 cP =
reinterpret_cast<const float *
>(&(image_calibration.
right.
P[0][0]));
580 for(uint32_t i=0; i<12; i++) cal.right_P[i] = cP[i];
590 ROS_WARN(
"Camera: invalid aux camera calibration");
600 std::vector<geometry_msgs::TransformStamped> stamped_transforms{};
602 stamped_transforms.emplace_back();
603 tf2::Transform rectified_left_T_left{toRotation(image_calibration.
left.
R), tf2::Vector3{0., 0., 0.}};
607 stamped_transforms.back().transform =
tf2::toMsg(rectified_left_T_left);
609 if (has_right_extrinsics)
611 stamped_transforms.emplace_back();
617 stamped_transforms.back().transform =
tf2::toMsg(rectified_right_T_rectified_left.inverse());
619 stamped_transforms.emplace_back();
620 tf2::Transform rectified_right_T_right{toRotation(image_calibration.
right.
R), tf2::Vector3{0., 0., 0.}};
624 stamped_transforms.back().transform =
tf2::toMsg(rectified_right_T_right);
627 if (has_aux_extrinsics)
631 stamped_transforms.emplace_back();
633 tf2::Vector3{aux_T(0), aux_T(1), aux_T(2)}};
637 stamped_transforms.back().transform =
tf2::toMsg(rectified_aux_T_rectified_left.inverse());
639 stamped_transforms.emplace_back();
640 tf2::Transform rectified_aux_T_aux{toRotation(image_calibration.
aux.
R), tf2::Vector3{0., 0., 0.}};
644 stamped_transforms.back().transform =
tf2::toMsg(rectified_aux_T_aux);
678 driver_->
addIsolatedCallback(rectCB, Source_Luma_Rectified_Left | Source_Luma_Rectified_Right | Source_Luma_Rectified_Aux,
this);
683 Source_Luma_Left | Source_Luma_Rectified_Left,
this);
714 const char *pcColorFrameSyncEnvStringP = getenv(
"MULTISENSE_ROS_PC_COLOR_FRAME_SYNC_OFF");
715 if (NULL != pcColorFrameSyncEnvStringP) {
716 ROS_INFO(
"color point cloud frame sync is disabled");
780 Eigen::Matrix<float, 3, 3> eigen_rot =
781 (Eigen::AngleAxis<float>(extrinsics.
yaw, Eigen::Matrix<float, 3, 1>(0, 0, 1))
782 * Eigen::AngleAxis<float>(extrinsics.
pitch, Eigen::Matrix<float, 3, 1>(0, 1, 0))
783 * Eigen::AngleAxis<float>(extrinsics.
roll, Eigen::Matrix<float, 3, 1>(1, 0, 0))).matrix();
796 std::vector<geometry_msgs::TransformStamped> extrinsic_transforms_(1);
798 tf2::Transform multisense_head_T_origin{tf2_rot, tf2::Vector3{extrinsics.
x, extrinsics.
y, extrinsics.
z}};
802 extrinsic_transforms_[0].transform =
tf2::toMsg(multisense_head_T_origin);
821 multisense_ros::Histogram rh;
825 if (Status_Ok == status) {
826 rh.frame_count =
header.frameId;
828 1000 *
header.timeMicroSeconds);
830 rh.height =
header.height;
832 case Source_Chroma_Left:
833 case Source_Chroma_Right:
838 rh.exposure_time =
header.exposure;
840 rh.fps =
header.framesPerSecond;
851 if (Source_Jpeg_Left !=
header.source) {
859 throw std::runtime_error(
"Uninitialized stereo calibration manager");
862 const uint32_t height =
header.height;
863 const uint32_t width =
header.width;
864 const uint32_t rgbLength = height * width * 3;
876 tjhandle jpegDecompressor = tjInitDecompress();
877 tjDecompress2(jpegDecompressor,
878 reinterpret_cast<unsigned char*
>(
const_cast<void*
>(
header.imageDataP)),
881 width, 0, height, TJPF_RGB, 0);
882 tjDestroy(jpegDecompressor);
895 const cv::Mat rgb_image(height, width, CV_8UC3, &(
left_rgb_image_.data[0]));
900 cv::remap(rgb_image, rect_rgb_image, left_remap->map1, left_remap->map2, cv::INTER_LINEAR);
916 if (!((Source_Disparity ==
header.source &&
918 (Source_Disparity_Right ==
header.source &&
920 (Source_Disparity_Cost ==
header.source &&
922 (Source_Disparity ==
header.source &&
924 (Source_Disparity_Right ==
header.source &&
934 throw std::runtime_error(
"Uninitialized stereo calibration manager");
938 case Source_Disparity:
939 case Source_Disparity_Right:
941 sensor_msgs::Image *imageP = NULL;
943 sensor_msgs::CameraInfo camInfo;
946 stereo_msgs::DisparityImage *stereoDisparityImageP = NULL;
949 if (Source_Disparity ==
header.source) {
971 imageP->data.resize(imageSize);
972 memcpy(&imageP->data[0],
header.imageDataP, imageSize);
974 imageP->header.stamp =
t;
975 imageP->height =
header.height;
976 imageP->width =
header.width;
977 imageP->is_bigendian = (htonl(1) == 1);
979 switch(
header.bitsPerPixel) {
982 imageP->step =
header.width;
986 imageP->step =
header.width * 2;
997 throw std::runtime_error(
"Stereo calibration manager missing right calibration");
1005 if (camInfo.P[0] != camInfo.P[5])
1007 std::stringstream warning;
1008 warning <<
"Current camera configuration has non-square pixels (fx != fy).";
1009 warning <<
"The stereo_msgs/DisparityImage does not account for";
1010 warning <<
" this. Be careful when reprojecting to a pointcloud.";
1011 ROS_WARN(
"%s", warning.str().c_str());
1018 uint32_t floatingPointImageSize =
header.width *
header.height * 4;
1019 stereoDisparityImageP->image.data.resize(floatingPointImageSize);
1021 stereoDisparityImageP->header.stamp =
t;
1023 stereoDisparityImageP->image.height =
header.height;
1024 stereoDisparityImageP->image.width =
header.width;
1025 stereoDisparityImageP->image.is_bigendian = (htonl(1) == 1);
1026 stereoDisparityImageP->image.header.stamp =
t;
1027 stereoDisparityImageP->image.header.frame_id = stereoDisparityImageP->header.frame_id;
1029 stereoDisparityImageP->image.step = 4 *
header.width;
1035 stereoDisparityImageP->f = camInfo.P[0];
1042 stereoDisparityImageP->min_disparity = 0;
1044 stereoDisparityImageP->delta_d = 1./16.;
1052 cv::Mat_<uint16_t> tmpImage(
header.height,
1054 reinterpret_cast<uint16_t*
>(
1055 const_cast<void*
>(
header.imageDataP)));
1060 cv::Mat_<float> floatingPointImage(
header.height,
1062 reinterpret_cast<float*
>(&stereoDisparityImageP->image.data[0]));
1068 floatingPointImage = tmpImage / 16.0;
1070 stereoDisparityPubP->
publish(*stereoDisparityImageP);
1073 camInfoPubP->
publish(camInfo);
1077 case Source_Disparity_Cost:
1101 if (Source_Luma_Left !=
header.source &&
1102 Source_Luma_Right !=
header.source &&
1103 Source_Luma_Aux !=
header.source) {
1105 ROS_ERROR(
"Camera: unexpected mono image source: 0x%lx",
header.source);
1113 throw std::runtime_error(
"Uninitialized stereo calibration manager");
1117 case Source_Luma_Left:
1128 switch(
header.bitsPerPixel) {
1149 case Source_Luma_Right:
1159 switch(
header.bitsPerPixel) {
1179 case Source_Luma_Aux:
1189 switch(
header.bitsPerPixel) {
1213 if (Source_Luma_Rectified_Left !=
header.source &&
1214 Source_Luma_Rectified_Right !=
header.source &&
1215 Source_Luma_Rectified_Aux !=
header.source) {
1217 ROS_ERROR(
"Camera: unexpected rectified image source: 0x%lx",
header.source);
1225 throw std::runtime_error(
"Uninitialized stereo calibration manager");
1229 case Source_Luma_Rectified_Left:
1240 switch(
header.bitsPerPixel) {
1267 case Source_Luma_Rectified_Right:
1278 switch(
header.bitsPerPixel) {
1303 case Source_Luma_Rectified_Aux:
1314 switch(
header.bitsPerPixel) {
1344 if (Source_Disparity !=
header.source) {
1346 ROS_ERROR(
"Camera: unexpected depth image source: 0x%lx",
header.source);
1353 if (0 == niDepthSubscribers && 0 == depthSubscribers)
1362 throw std::runtime_error(
"Uninitialized stereo calibration manager");
1365 const float bad_point = std::numeric_limits<float>::quiet_NaN();
1366 const uint32_t depthSize =
header.height *
header.width *
sizeof(float);
1367 const uint32_t niDepthSize =
header.height *
header.width *
sizeof(uint16_t);
1368 const uint32_t imageSize =
header.width *
header.height;
1387 float *depthImageP =
reinterpret_cast<float*
>(&
depth_image_.data[0]);
1388 uint16_t *niDepthImageP =
reinterpret_cast<uint16_t*
>(&
ni_depth_image_.data[0]);
1390 const uint16_t min_ni_depth = std::numeric_limits<uint16_t>::lowest();
1391 const uint16_t max_ni_depth = std::numeric_limits<uint16_t>::max();
1396 throw std::runtime_error(
"Stereo calibration manager missing right calibration");
1402 if (32 ==
header.bitsPerPixel) {
1415 const float *disparityImageP =
reinterpret_cast<const float*
>(
header.imageDataP);
1417 for (uint32_t i = 0 ; i < imageSize ; ++i)
1419 if (0.0 >= disparityImageP[i])
1421 depthImageP[i] = bad_point;
1422 niDepthImageP[i] = 0;
1426 depthImageP[i] = scale / disparityImageP[i];
1427 niDepthImageP[i] =
static_cast<uint16_t
>(std::min(
static_cast<float>(max_ni_depth),
1428 std::max(
static_cast<float>(min_ni_depth),
1429 depthImageP[i] * 1000)));
1436 }
else if (16 ==
header.bitsPerPixel) {
1451 const uint16_t *disparityImageP =
reinterpret_cast<const uint16_t*
>(
header.imageDataP);
1453 for (uint32_t i = 0 ; i < imageSize ; ++i)
1455 if (0 == disparityImageP[i])
1457 depthImageP[i] = bad_point;
1458 niDepthImageP[i] = 0;
1462 depthImageP[i] = scale / disparityImageP[i];
1463 niDepthImageP[i] =
static_cast<uint16_t
>(std::min(
static_cast<float>(max_ni_depth),
1464 std::max(
static_cast<float>(min_ni_depth),
1465 depthImageP[i] * 1000)));
1470 ROS_ERROR(
"Camera: unsupported disparity bpp: %d",
header.bitsPerPixel);
1474 if (0 != niDepthSubscribers)
1479 if (0 != depthSubscribers)
1489 if (Source_Disparity !=
header.source) {
1491 ROS_ERROR(
"Camera: unexpected pointcloud image source: 0x%lx",
header.source);
1497 throw std::runtime_error(
"Uninitialized stereo calibration manager");
1503 std::shared_ptr<BufferWrapper<image::Header>> left_luma_rect =
nullptr;
1504 std::shared_ptr<BufferWrapper<image::Header>> left_luma =
nullptr;
1505 std::shared_ptr<BufferWrapper<image::Header>> left_chroma =
nullptr;
1506 std::shared_ptr<BufferWrapper<image::Header>> aux_luma_rectified =
nullptr;
1507 std::shared_ptr<BufferWrapper<image::Header>> aux_chroma_rectified =
nullptr;
1509 const auto left_rect_image =
image_buffers_.find(Source_Luma_Rectified_Left);
1510 if (left_rect_image != std::end(
image_buffers_) && left_rect_image->second->data().frameId ==
header.frameId) {
1511 left_luma_rect = left_rect_image->second;
1514 const auto left_luma_image =
image_buffers_.find(Source_Luma_Left);
1515 if (left_luma_image != std::end(
image_buffers_) && left_luma_image->second->data().frameId ==
header.frameId) {
1516 left_luma = left_luma_image->second;
1519 const auto chroma_image =
image_buffers_.find(Source_Chroma_Left);
1520 if (chroma_image != std::end(
image_buffers_) && chroma_image->second->data().frameId ==
header.frameId) {
1521 left_chroma = chroma_image->second;
1524 const auto aux_luma_rectified_image =
image_buffers_.find(Source_Luma_Rectified_Aux);
1525 if (aux_luma_rectified_image != std::end(
image_buffers_) && aux_luma_rectified_image->second->data().frameId ==
header.frameId) {
1526 aux_luma_rectified = aux_luma_rectified_image->second;
1529 const auto aux_chroma_rectified_image =
image_buffers_.find(Source_Chroma_Rectified_Aux);
1530 if (aux_chroma_rectified_image != std::end(
image_buffers_) && aux_chroma_rectified_image->second->data().frameId ==
header.frameId) {
1531 aux_chroma_rectified = aux_chroma_rectified_image->second;
1542 if (!(pub_pointcloud || pub_color_pointcloud || pub_organized_pointcloud || pub_color_organized_pointcloud))
1554 switch(left_luma_rect->data().bitsPerPixel)
1575 ROS_ERROR(
"Camera: unsupported luma rectified depth for pontcloud conversion: %d", left_luma_rect->data().bitsPerPixel);
1579 if (pub_color_pointcloud)
1590 if (pub_organized_pointcloud)
1592 switch(left_luma_rect->data().bitsPerPixel)
1613 ROS_ERROR(
"Camera: unsupported luma rectified depth for pontcloud conversion: %d", left_luma_rect->data().bitsPerPixel);
1617 if (pub_color_organized_pointcloud)
1628 const Eigen::Vector3f invalid_point(std::numeric_limits<float>::quiet_NaN(),
1629 std::numeric_limits<float>::quiet_NaN(),
1630 std::numeric_limits<float>::quiet_NaN());
1635 cv::Mat rectified_color;
1636 if (!
has_aux_camera_ && (pub_color_pointcloud || pub_color_organized_pointcloud))
1638 const auto &luma = left_luma->data();
1649 cv::remap(rgb_image, rect_rgb_image, left_remap->map1, left_remap->map2, cv::INTER_LINEAR);
1651 rectified_color = std::move(rect_rgb_image);
1653 else if(
has_aux_camera_ && (pub_color_pointcloud || pub_color_organized_pointcloud))
1655 const auto &luma = aux_luma_rectified->data();
1668 (
header.width != luma.width ||
header.height != luma.height))
1670 cv::Mat resized_rect_rgb_image;
1671 cv::resize(rect_rgb_image,
1672 resized_rect_rgb_image,
1673 cv::Size{
static_cast<int>(
header.width),
static_cast<int>(
header.height)},
1674 0, 0, cv::INTER_AREA);
1676 rect_rgb_image = std::move(resized_rect_rgb_image);
1679 rectified_color = std::move(rect_rgb_image);
1685 throw std::runtime_error(
"Stereo calibration manager missing right calibration");
1691 rectified_color.cols, rectified_color.rows);
1696 uint32_t packed_color = 0;
1700 size_t valid_points = 0;
1701 for (
size_t y = 0 ; y <
header.height ; ++y)
1703 for (
size_t x = 0 ; x <
header.width ; ++x)
1705 const size_t index = y *
header.width + x;
1707 float disparity = 0.0f;
1708 switch(
header.bitsPerPixel)
1712 disparity =
static_cast<float>(
reinterpret_cast<const uint16_t*
>(
header.imageDataP)[index]) / 16.0f;
1717 disparity =
static_cast<float>(
reinterpret_cast<const float*
>(
header.imageDataP)[index]);
1722 ROS_ERROR(
"Camera: unsupported disparity detph: %d",
header.bitsPerPixel);
1728 left_camera_info, right_camera_info);
1734 if (!rectified_color.empty())
1741 rectified_color.at<cv::Vec3b>(y, x);
1744 packed_color |= color_pixel[2] << 16 | color_pixel[1] << 8 | color_pixel[0];
1753 if (pub_organized_pointcloud)
1758 if (pub_color_organized_pointcloud)
1768 if (pub_pointcloud && valid)
1770 writePoint(
luma_point_cloud_, valid_points, point, index, left_luma_rect->data().bitsPerPixel, left_luma_rect->data().imageDataP);
1773 if(pub_color_pointcloud && valid)
1778 if (pub_organized_pointcloud)
1783 if (pub_color_organized_pointcloud)
1804 if (pub_color_pointcloud)
1813 if (pub_organized_pointcloud)
1818 if (pub_color_organized_pointcloud)
1831 if(Source_Disparity ==
header.source)
1833 const auto image =
image_buffers_.find(Source_Luma_Rectified_Left);
1836 const auto luma_ptr = image->second;
1837 const auto &left_luma_rect = luma_ptr->data();
1839 const uint32_t left_luma_image_size = left_luma_rect.width * left_luma_rect.height;
1841 raw_cam_data_.gray_scale_image.resize(left_luma_image_size);
1843 left_luma_rect.imageDataP,
1844 left_luma_image_size *
sizeof(uint8_t));
1846 raw_cam_data_.frames_per_second = left_luma_rect.framesPerSecond;
1850 raw_cam_data_.time_stamp =
ros::Time(left_luma_rect.timeSeconds, 1000 * left_luma_rect.timeMicroSeconds);
1854 const uint32_t disparity_size =
header.width *
header.height;
1859 disparity_size *
header.bitsPerPixel == 16 ?
sizeof(uint16_t) :
sizeof(uint32_t));
1871 if (Source_Chroma_Left !=
header.source &&
1872 Source_Chroma_Rectified_Aux !=
header.source &&
1873 Source_Chroma_Aux !=
header.source)
1875 ROS_WARN(
"Camera: unexpected color image source: 0x%lx",
header.source);
1883 throw std::runtime_error(
"Uninitialized stereo calibration manager");
1888 case Source_Chroma_Left:
1894 if (color_subscribers == 0 && color_rect_subscribers == 0)
1904 const auto luma_ptr = left_luma->second;
1906 if (
header.frameId == luma_ptr->data().frameId) {
1908 const uint32_t height = luma_ptr->data().height;
1909 const uint32_t width = luma_ptr->data().width;
1910 const uint32_t imageSize = 3 * height * width;
1930 if (color_subscribers != 0) {
1936 if (color_rect_subscribers > 0) {
1943 const cv::Mat rgb_image(height, width, CV_8UC3, &(
left_rgb_image_.data[0]));
1946 cv::remap(rgb_image, rect_rgb_image, remaps->map1, remaps->map2, cv::INTER_LINEAR);
1965 case Source_Chroma_Rectified_Aux:
1971 const auto aux_luma =
image_buffers_.find(Source_Luma_Rectified_Aux);
1976 const auto luma_ptr = aux_luma->second;
1978 if (
header.frameId == luma_ptr->data().frameId) {
1980 const uint32_t height = luma_ptr->data().height;
1981 const uint32_t width = luma_ptr->data().width;
1982 const uint32_t imageSize = 3 * height * width;
2009 case Source_Chroma_Aux:
2020 const auto luma_ptr = aux_luma->second;
2022 if (
header.frameId == luma_ptr->data().frameId) {
2023 const uint32_t height = luma_ptr->data().height;
2024 const uint32_t width = luma_ptr->data().width;
2025 const uint32_t imageSize = 3 * height * width;
2057 if (Source_Luma_Rectified_Aux !=
header.source &&
2058 Source_Chroma_Rectified_Aux !=
header.source &&
2059 Source_Luma_Aux !=
header.source &&
2060 Source_Luma_Left !=
header.source &&
2061 Source_Chroma_Left !=
header.source &&
2062 Source_Luma_Rectified_Left !=
header.source) {
2063 ROS_WARN(
"Camera: unexpected colorized image source: 0x%lx",
header.source);
2072 if (Source_Ground_Surface_Class_Image !=
header.source)
2074 ROS_WARN(
"Camera: unexpected image source: 0x%lx",
header.source);
2082 throw std::runtime_error(
"Uninitialized stereo calibration manager");
2087 case Source_Ground_Surface_Class_Image:
2091 if (ground_surface_subscribers == 0)
2094 const uint32_t height =
header.height;
2095 const uint32_t width =
header.width;
2096 const uint32_t imageSize = 3 * height * width;
2117 const size_t row_offset = y * rgb_stride;
2121 const uint8_t *imageP =
reinterpret_cast<const uint8_t*
>(
header.imageDataP);
2141 if (
header.controlPointsBitsPerPixel != 32)
2143 ROS_WARN(
"Expecting floats for spline control points, got %u bits per pixel instead",
header.controlPointsBitsPerPixel);
2149 ROS_WARN(
"Ground surface modelling failed, consider modifying camera extrinsics and/or algorithm parameters");
2155 throw std::runtime_error(
"Uninitialized stereo calibration manager");
2159 Eigen::Map<const Eigen::Matrix<float, Eigen::Dynamic, Eigen::Dynamic, Eigen::RowMajor>> controlGrid(
2160 reinterpret_cast<const float*
>(
header.controlPointsImageDataP),
header.controlPointsHeight,
header.controlPointsWidth);
2165 float minMaxAzimuthAngle[2];
2166 minMaxAzimuthAngle[0] = M_PI_2 - atan(config.cx() / config.fx());
2167 minMaxAzimuthAngle[1] = M_PI_2 + atan((config.width() - config.cx()) / config.fx());
2189 throw std::runtime_error(
"Uninitialized stereo calibration manager");
2197 multisense_ros::RawCamConfig cfg;
2199 cfg.width = config.
width();
2200 cfg.height = config.
height();
2201 cfg.frames_per_second = config.
fps();
2202 cfg.gain = config.
gain();
2203 cfg.exposure_time = config.
exposure();
2205 cfg.fx = config.
fx();
2206 cfg.fy = config.
fy();
2207 cfg.cx = config.
cx();
2208 cfg.cy = config.
cy();
2209 cfg.tx = config.
tx();
2210 cfg.ty = config.
ty();
2211 cfg.tz = config.
tz();
2212 cfg.roll = config.
roll();
2213 cfg.pitch = config.
pitch();
2214 cfg.yaw = config.
yaw();
2230 throw std::runtime_error(
"Uninitialized stereo calibration manager");
2317 stat.
add(
"pcb: " + pcb.name, pcb.revision);
2348 stat.
summary(diagnostic_msgs::DiagnosticStatus::OK,
"MultiSense Device Info");
2361 stat.
add(
"imu", statusMessage.
imuOk);
2373 stat.
summary(diagnostic_msgs::DiagnosticStatus::OK,
"MultiSense Status: OK");
2375 stat.
summary(diagnostic_msgs::DiagnosticStatus::ERROR,
"MultiSense Status: ERROR - Unable to retrieve status");
2391 if (Status_Ok != status)
2392 ROS_ERROR(
"Camera: failed to stop all streams: %s",
2393 Channel::statusString(status));
2402 for(uint32_t i=0; i<32; i++)
2403 if ((1<<i) & enableMask && 0 ==
stream_map_[(1<<i)]++)
2404 notStarted |= (1<<i);
2406 if (0 != notStarted) {
2409 if (Status_Ok != status)
2410 ROS_ERROR(
"Camera: failed to start streams 0x%lx: %s",
2411 notStarted, Channel::statusString(status));
2421 for(uint32_t i=0; i<32; i++)
2422 if ((1<<i) & disableMask && 0 == --
stream_map_[(1<<i)])
2423 notStopped |= (1<<i);
2425 if (0 != notStopped) {
2427 if (Status_Ok != status)
2428 ROS_ERROR(
"Camera: failed to stop streams 0x%lx: %s\n",
2429 notStopped, Channel::statusString(status));