#include <geometry_msgs/Pose.h>
#include <geometry_msgs/PoseWithCovariance.h>
#include <mrpt/graphs/TNodeID.h>
#include <mrpt/ros1bridge/pose.h>
#include <mrpt_msgs/NodeIDWithPose.h>
#include <mrpt_msgs_bridge/network_of_poses.h>
#include <iostream>
Go to the source code of this file.
Functions | |
void | convert ([[maybe_unused]] mrpt_msgs::NetworkOfPoses &ros_graph, [[maybe_unused]] const mrpt::graphs::CNetworkOfPoses3DInf_NA &mrpt_graph) |
void convert | ( | [[maybe_unused] ] mrpt_msgs::NetworkOfPoses & | ros_graph, |
[[maybe_unused] ] const mrpt::graphs::CNetworkOfPoses3DInf_NA & | mrpt_graph | ||
) |
Definition at line 295 of file network_of_poses.cpp.