Skip to content

Commit 4956c50

Browse files
committed
format
1 parent 00d7c0e commit 4956c50

File tree

6 files changed

+15
-15
lines changed

6 files changed

+15
-15
lines changed

depthai_filters/src/detection2d_overlay.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -13,8 +13,8 @@ Detection2DOverlay::Detection2DOverlay(const rclcpp::NodeOptions& options) : rcl
1313
void Detection2DOverlay::onInit() {
1414
previewSub.subscribe(this, "rgb/preview/image_raw");
1515
detSub.subscribe(this, "nn/detections");
16-
sync = std::make_unique<message_filters::Synchronizer<syncPolicy>>(syncPolicy(10), previewSub, detSub);
17-
sync->registerCallback(std::bind(&Detection2DOverlay::overlayCB, this, std::placeholders::_1, std::placeholders::_2 ));
16+
sync = std::make_unique<message_filters::Synchronizer<syncPolicy>>(syncPolicy(10), previewSub, detSub);
17+
sync->registerCallback(std::bind(&Detection2DOverlay::overlayCB, this, std::placeholders::_1, std::placeholders::_2));
1818
overlayPub = this->create_publisher<sensor_msgs::msg::Image>("overlay", 10);
1919
labelMap = this->declare_parameter<std::vector<std::string>>("label_map", labelMap);
2020
}

depthai_ros_driver/include/depthai_ros_driver/dai_nodes/nn/spatial_detection.hpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -77,7 +77,7 @@ class SpatialDetection : public BaseNode {
7777
pubConf.height = height;
7878
pubConf.daiNodeName = getName();
7979
pubConf.topicName = "~/" + getName() + "/passthrough";
80-
pubConf.infoSuffix = "/passthrough";
80+
pubConf.infoSuffix = "/passthrough";
8181
pubConf.socket = static_cast<dai::CameraBoardSocket>(ph->getParam<int>("i_board_socket_id"));
8282

8383
ptPub->setup(device, convConf, pubConf);
@@ -98,7 +98,7 @@ class SpatialDetection : public BaseNode {
9898
pubConf.height = ph->getOtherNodeParam<int>(sensor_helpers::getNodeName(getROSNode(), sensor_helpers::NodeNameEnum::Stereo), "i_height");
9999
pubConf.daiNodeName = getName();
100100
pubConf.topicName = "~/" + getName() + "/passthrough_depth";
101-
pubConf.infoSuffix = "/passthrough_depth";
101+
pubConf.infoSuffix = "/passthrough_depth";
102102
pubConf.socket = socket;
103103

104104
ptDepthPub->setup(device, convConf, pubConf);

depthai_ros_driver/include/depthai_ros_driver/param_handlers/nn_param_handler.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -40,7 +40,7 @@ class NNParamHandler : public BaseParamHandler {
4040
template <typename T>
4141
void declareParams(std::shared_ptr<T> nn, std::shared_ptr<dai::node::ImageManip> imageManip) {
4242
declareAndLogParam<bool>("i_disable_resize", false);
43-
declareAndLogParam<bool>("i_desqueeze_output", false);
43+
declareAndLogParam<bool>("i_desqueeze_output", false);
4444
declareAndLogParam<bool>("i_enable_passthrough", false);
4545
declareAndLogParam<bool>("i_enable_passthrough_depth", false);
4646
declareAndLogParam<bool>("i_get_base_device_timestamp", false);

depthai_ros_driver/include/depthai_ros_driver/utils.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -67,7 +67,7 @@ struct ImgPublisherConfig {
6767
dai::CameraBoardSocket rightSocket = dai::CameraBoardSocket::CAM_C;
6868
std::string calibrationFile = "";
6969
std::string topicSuffix = "/image_raw";
70-
std::string infoSuffix = "";
70+
std::string infoSuffix = "";
7171
std::string compressedTopicSuffix = "/image_raw/compressed";
7272
std::string infoMgrSuffix = "";
7373
bool rectified = false;

depthai_ros_driver/src/dai_nodes/sensors/stereo.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -199,7 +199,7 @@ void Stereo::setupStereoQueue(std::shared_ptr<dai::Device> device) {
199199
utils::ImgPublisherConfig pubConf;
200200
pubConf.daiNodeName = getName();
201201
pubConf.topicName = "~/" + getName();
202-
pubConf.topicSuffix = rsCompabilityMode() ? "/image_rect_raw" : "/image_raw";
202+
pubConf.topicSuffix = rsCompabilityMode() ? "/image_rect_raw" : "/image_raw";
203203
pubConf.rectified = !convConfig.alphaScalingEnabled;
204204
pubConf.width = ph->getParam<int>("i_width");
205205
pubConf.height = ph->getParam<int>("i_height");

depthai_ros_driver/src/param_handlers/sensor_param_handler.cpp

+8-8
Original file line numberDiff line numberDiff line change
@@ -79,19 +79,19 @@ void SensorParamHandler::declareParams(std::shared_ptr<dai::node::MonoCamera> mo
7979
}
8080
monoCam->setImageOrientation(
8181
utils::getValFromMap(declareAndLogParam<std::string>("i_sensor_img_orientation", "AUTO"), dai_nodes::sensor_helpers::cameraImageOrientationMap));
82-
int expLimit = declareAndLogParam<int>("r_auto_exposure_limit", 1000);
82+
int expLimit = declareAndLogParam<int>("r_auto_exposure_limit", 1000);
8383
if(declareAndLogParam<bool>("r_set_auto_exposure_limit", false)) {
8484
monoCam->initialControl.setAutoExposureLimit(expLimit);
8585
}
86-
int sharpness = declareAndLogParam<int>("r_sharpness", 1);
86+
int sharpness = declareAndLogParam<int>("r_sharpness", 1);
8787
if(declareAndLogParam("r_set_sharpness", false)) {
8888
monoCam->initialControl.setSharpness(sharpness);
8989
}
90-
int chromaDenoise = declareAndLogParam<int>("r_chroma_denoise", 1);
90+
int chromaDenoise = declareAndLogParam<int>("r_chroma_denoise", 1);
9191
if(declareAndLogParam("r_set_chroma_denoise", false)) {
9292
monoCam->initialControl.setChromaDenoise(chromaDenoise);
9393
}
94-
int lumaDenoise = declareAndLogParam<int>("r_luma_denoise", 1);
94+
int lumaDenoise = declareAndLogParam<int>("r_luma_denoise", 1);
9595
if(declareAndLogParam("r_set_luma_denoise", false)) {
9696
monoCam->initialControl.setLumaDenoise(lumaDenoise);
9797
}
@@ -194,19 +194,19 @@ void SensorParamHandler::declareParams(std::shared_ptr<dai::node::ColorCamera> c
194194
}
195195
colorCam->setImageOrientation(
196196
utils::getValFromMap(declareAndLogParam<std::string>("i_sensor_img_orientation", "AUTO"), dai_nodes::sensor_helpers::cameraImageOrientationMap));
197-
int expLimit = declareAndLogParam<int>("r_auto_exposure_limit", 1000);
197+
int expLimit = declareAndLogParam<int>("r_auto_exposure_limit", 1000);
198198
if(declareAndLogParam<bool>("r_set_auto_exposure_limit", false)) {
199199
colorCam->initialControl.setAutoExposureLimit(expLimit);
200200
}
201-
int sharpness = declareAndLogParam<int>("r_sharpness", 1);
201+
int sharpness = declareAndLogParam<int>("r_sharpness", 1);
202202
if(declareAndLogParam("r_set_sharpness", false)) {
203203
colorCam->initialControl.setSharpness(sharpness);
204204
}
205-
int chromaDenoise = declareAndLogParam<int>("r_chroma_denoise", 1);
205+
int chromaDenoise = declareAndLogParam<int>("r_chroma_denoise", 1);
206206
if(declareAndLogParam("r_set_chroma_denoise", false)) {
207207
colorCam->initialControl.setChromaDenoise(chromaDenoise);
208208
}
209-
int lumaDenoise = declareAndLogParam<int>("r_luma_denoise", 1);
209+
int lumaDenoise = declareAndLogParam<int>("r_luma_denoise", 1);
210210
if(declareAndLogParam("r_set_luma_denoise", false)) {
211211
colorCam->initialControl.setLumaDenoise(lumaDenoise);
212212
}

0 commit comments

Comments
 (0)