Skip to content

Instantly share code, notes, and snippets.

View raiots's full-sized avatar

Yutong LI raiots

View GitHub Profile
@robodhruv
robodhruv / odom_to_path.py
Last active May 29, 2023 09:10
ROS Node for converting nav_msgs/odometry messages to nav_msgs/Path
#!/usr/bin/env python
from __future__ import print_function
import rospy
from tf.transformations import quaternion_from_euler
from std_msgs.msg import String
from nav_msgs.msg import Odometry, Path
from geometry_msgs.msg import PoseWithCovarianceStamped, PoseStamped
from sensor_msgs.msg import Joy
import sys
import json