#!/usr/bin/env python
#coding=utf-8
#女生节礼物
import rospy
from sensor_msgs.msg import LaserScan
import numpy
import copy
node_name = "Test_Maker"
class Test_Maker():
def __init__(self):
self.Define()
rospy.Timer(rospy.Duration(0.5), self.Timer_CB1)
rospy.Timer(rospy.Duration(0.5), self.Timer_CB2)
rospy.Timer(rospy.Duration(0.5), self.Timer_CB3)
rospy.Timer(rospy.Duration(0.5), self.Timer_CB4)
rospy.spin()
def Define(self):
self.pub_scan1 = rospy.Publisher('test/test_scan1', LaserScan, queue_size=1)
self.pub_scan2 = rospy.Publisher('test/test_scan2', LaserScan, queue_size=1)
self.pub_scan3 = rospy.Publisher('test/test_scan3', LaserScan, queue_size=1)
#慎用!!!!
self.pub_scan4 = rospy.Publisher('test/test_scan4', LaserScan, queue_size=1)
def Timer_CB1(self, e):
data = LaserScan()
data.header.frame_id = "base_link"
data.angle_min =