Tool for extracting pbstream trajectories into bag with tf. (#1166)

For every trajectory, writes tf
        FLAGS_parent_frame --> trajectory_`trajectory_id`
master
Sebastian Klose 2019-01-20 17:12:41 +01:00 committed by Wally B. Feed
parent 63eaf6d257
commit 6ee68c22f9
2 changed files with 106 additions and 0 deletions

View File

@ -102,6 +102,17 @@ install(TARGETS cartographer_pbstream_map_publisher
RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
)
google_binary(cartographer_dev_pbstream_trajectories_to_rosbag
SRCS
dev/pbstream_trajectories_to_rosbag_main.cc
)
install(TARGETS cartographer_dev_pbstream_trajectories_to_rosbag
ARCHIVE DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
LIBRARY DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
)
google_binary(cartographer_dev_rosbag_publisher
SRCS
dev/rosbag_publisher_main.cc

View File

@ -0,0 +1,95 @@
/*
* Copyright 2019 The Cartographer Authors
*
* Licensed under the Apache License, Version 2.0 (the "License");
* you may not use this file except in compliance with the License.
* You may obtain a copy of the License at
*
* http://www.apache.org/licenses/LICENSE-2.0
*
* Unless required by applicable law or agreed to in writing, software
* distributed under the License is distributed on an "AS IS" BASIS,
* WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
* See the License for the specific language governing permissions and
* limitations under the License.
*/
#include <iostream>
#include <string>
#include <vector>
#include "absl/strings/str_cat.h"
#include "cartographer/transform/transform.h"
#include "cartographer_ros/msg_conversion.h"
#include "cartographer_ros/time_conversion.h"
#include "geometry_msgs/TransformStamped.h"
#include "gflags/gflags.h"
#include "glog/logging.h"
#include "rosbag/bag.h"
#include "tf2_msgs/TFMessage.h"
DEFINE_string(input, "", "pbstream file to process");
DEFINE_string(output, "", "Bag file to write to.");
DEFINE_string(parent_frame, "map", "Frame id to use as parent frame.");
namespace cartographer_ros {
namespace {
geometry_msgs::TransformStamped ToTransformStamped(
int64_t timestamp_uts, const std::string& parent_frame_id,
const std::string& child_frame_id,
const cartographer::transform::proto::Rigid3d& parent_T_child) {
static int64_t seq = 0;
geometry_msgs::TransformStamped xfm;
xfm.header.seq = ++seq;
xfm.header.frame_id = parent_frame_id;
xfm.header.stamp = cartographer_ros::ToRos(
::cartographer::common::FromUniversal(timestamp_uts));
xfm.child_frame_id = child_frame_id;
xfm.transform = cartographer_ros::ToGeometryMsgTransform(
::cartographer::transform::ToRigid3(parent_T_child));
return xfm;
}
void pbstream_trajectories_to_bag(const std::string& pbstream_filename,
const std::string& output_bag_filename,
const std::string& parent_frame_id) {
const auto pose_graph =
cartographer::io::DeserializePoseGraphFromFile(FLAGS_input);
rosbag::Bag bag(output_bag_filename, rosbag::bagmode::Write);
for (const auto trajectory : pose_graph.trajectory()) {
const auto child_frame_id =
absl::StrCat("trajectory_", trajectory.trajectory_id());
LOG(INFO) << "Writing tf for trajectory id " << trajectory.trajectory_id()
<< " with " << trajectory.node_size() << " nodes.";
for (const auto& node : trajectory.node()) {
tf2_msgs::TFMessage tf_msg;
tf_msg.transforms.push_back(ToTransformStamped(
node.timestamp(), parent_frame_id, child_frame_id, node.pose()));
bag.write("/tf", tf_msg.transforms[0].header.stamp, tf_msg);
}
}
}
} // namespace
} // namespace cartographer_ros
int main(int argc, char* argv[]) {
FLAGS_alsologtostderr = true;
google::InitGoogleLogging(argv[0]);
google::SetUsageMessage(
"\n\n"
"Extracts all trajectories from the pbstream and creates a bag file with "
"the trajectory poses stored in /tf.\nFor each trajectory, the tool will "
"write transforms with the tf parent_frame_id set according to the "
"`parent_frame` commandline flag and child_frame_id to `trajectory_i`, "
"with `i` corresponding to the `trajectory_id`.");
google::ParseCommandLineFlags(&argc, &argv, true);
CHECK(!FLAGS_input.empty()) << "-input pbstream is missing.";
CHECK(!FLAGS_output.empty()) << "-output is missing.";
cartographer_ros::pbstream_trajectories_to_bag(FLAGS_input, FLAGS_output,
FLAGS_parent_frame);
return 0;
}