对于给定的ros消息,有什么方法可以获得ros消息的子字段。我正在使用python脚本从rosbag文件中读取消息,
"for topic, msg, t in bag.read_messages(): "
现在给出主题和消息,我可以显示消息的子字段。
例如: nav / Odometry.msg具有子字段:" header"," child_frame_id"," pose"和"扭曲"。 (Reference link)
是否有一个命令将子字段作为输出返回? .. 如果我事先不知道子字段
由于
答案 0 :(得分:0)
这是一个简单的python节点(基于this),它完全符合您的要求:
#!/usr/bin/env python
import rospy
from nav_msgs.msg import Odometry
def callback(data):
rospy.loginfo(rospy.get_caller_id() + "I heard %s", data.header)
rospy.loginfo(rospy.get_caller_id() + "child_frame_id %s", data.child_frame_id)
rospy.loginfo(rospy.get_caller_id() + "pose %s", data.pose)
rospy.loginfo(rospy.get_caller_id() + "twist %s", data.twist)
def listener():
# In ROS, nodes are uniquely named. If two nodes with the same
# node are launched, the previous one is kicked off. The
# anonymous=True flag means that rospy will choose a unique
# name for our 'listener' node so that multiple listeners can
# run simultaneously.
rospy.init_node('listener', anonymous=True)
rospy.Subscriber("odom_topic", Odometry, callback)
# spin() simply keeps python from exiting until this node is stopped
rospy.spin()
if __name__ == '__main__':
listener()