10 import roslib;roslib.load_manifest(PKG)
12 from sensor_msgs.msg
import PointCloud2
18 setCloud = rospy.ServiceProxy(
'particle_filter_tracker/renew_model', SetPointCloud2)
19 setCloud(cloud, track_target_name)
20 rospy.loginfo(
"Success renew_tracking service");
21 except rospy.ServiceException
as e:
22 rospy.loginfo(
"Failed to call renew_tracking service")
24 if __name__ ==
"__main__":
25 rospy.init_node(
'send_renew_model', anonymous=
True)
26 rospy.wait_for_service(
'particle_filter_tracker/renew_model')
27 track_target_name = rospy.get_param(
'~track_target_name',
'track_result')
28 rospy.Subscriber(
"selected_pointcloud", PointCloud2, cloud_cb)