14 privateNh.
param < std::string
15 > (
"odom_topic",
_odom_topic,
"/ground_truth/state");
17 privateNh.
param < std::string
29 geometry_msgs::TransformStamped transformStamped;
34 transformStamped.transform.translation.x = msg->pose.pose.position.x;
35 transformStamped.transform.translation.y = msg->pose.pose.position.y;
36 transformStamped.transform.translation.z = 0;
37 transformStamped.transform.rotation.x = msg->pose.pose.orientation.x;
38 transformStamped.transform.rotation.y = msg->pose.pose.orientation.y;
39 transformStamped.transform.rotation.z = msg->pose.pose.orientation.z;
40 transformStamped.transform.rotation.w = msg->pose.pose.orientation.w;
void odomCallback(const nav_msgs::Odometry::ConstPtr &msg)
ros::Subscriber _odom_subscriber
tf2_ros::TransformBroadcaster _tf_broadcaster
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const