Skip to content

Commit 9c9f866

Browse files
remove extra semicolon (#98) (#101)
(cherry picked from commit 7cc2e97) Co-authored-by: Manu <[email protected]>
1 parent 52e63f8 commit 9c9f866

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

point_cloud_transport_py/src/point_cloud_transport_py/pybind_codec.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -95,7 +95,7 @@ void pointCloud2ToString(const sensor_msgs::msg::PointCloud2 & cloud, std::strin
9595
} // namespace point_cloud_transport
9696

9797
// Bindings for STL vector of strings
98-
PYBIND11_MAKE_OPAQUE(std::vector<std::string>);
98+
PYBIND11_MAKE_OPAQUE(std::vector<std::string>)
9999

100100
// Bindings for the PointCloudCodec class
101101
PYBIND11_MODULE(_codec, m)

0 commit comments

Comments
 (0)