AWS S3 :- 如何在我重新启动应用程序时获得失败的 AWSS3TransferUtility 任务?

问题描述

我想将失败的任务列表上传到 AWSS3TransferUtility。下面的代码,我曾经将图片上传到 S3。

#!/usr/bin/env python

import rospy
import numpy as np
from numpy import pi

from std_msgs.msg import Float64
from geometry_msgs.msg import Twist

class steering:

    def __init__(self):
        rospy.init_node("steering_controller",anonymous=True)
        rospy.Subscriber("/cmd_vel",Twist,self.cmd_vel_callback)

        self.steering_L_pub = rospy.Publisher("/xacro/left_steering_wheel_position_controller/command",Float64,queue_size=10)
        self.steering_R_pub = rospy.Publisher("/xacro/right_steering_wheel_position_controller/command",queue_size=10)
        


        self.str_L = Float64()
        self.str_R = Float64()
        self.drive_L = Float64()
        self.drive_R = Float64()

        self.Vx = 0.0
        self.Wz = 0.0

        self.max_alp = pi/2.0

        ## Car paramters
        self.wheel_radius = 0.2 # meter
        self.chassis_length = 4 
        self.chassis_width = 1 

        self.run()

        rospy.spin()

我已经检查了这个链接 AWSS3TransferUtility: How to retry failed upload task after app restart

在这链接中,他提到我们需要设置重试次数,但如果应用程序在前台后台,这用于再次重试任务。

我主要关心的是,假设在上传任务时互联网连接断开并假设用户相当应用程序。在这种情况下,当用户进入应用程序时,我希望任务失败并重新上传

解决方法

暂无找到可以解决该程序问题的有效方法,小编努力寻找整理中!

如果你已经找到好的解决方法,欢迎将解决方案带上本链接一起发送给小编。

小编邮箱:dio#foxmail.com (将#修改为@)

相关问答

Selenium Web驱动程序和Java。元素在(x,y)点处不可单击。其...
Python-如何使用点“。” 访问字典成员?
Java 字符串是不可变的。到底是什么意思?
Java中的“ final”关键字如何工作?(我仍然可以修改对象。...
“loop:”在Java代码中。这是什么,为什么要编译?
java.lang.ClassNotFoundException:sun.jdbc.odbc.JdbcOdbc...