4 from mm2client
import *
7 from dynamic_reconfigure.server
import Server
as DynamicReconfigureServer
8 from mini_maxwell.cfg
import DRCEnvironmentConfig
as ConfigType
9 from threading
import Lock
10 from random
import randint
11 from std_msgs.msg
import Bool, Time
18 self.
mm2name = rospy.get_param(
'~ip',
'133.11.216.47')
37 self.
filters = [low_speed_filter, high_speed_filter]
49 self.pub_is_blackout.publish(Bool(data=self.
blackoutp))
50 self.pub_next_whiteout_time.publish(Time(data=self.
next_whiteout))
54 now = rospy.Time.now()
73 rospy.loginfo(
"blackout")
81 rospy.loginfo(
"whiteout")
112 self.bands.SetDropAmount(5, LANB_to_LANA, 0)
113 self.bands.SetDropAmount(5, LANA_to_LANB, 0)
123 self.bands.SetDropAmount(5, LANB_to_LANA, 0)
124 self.bands.SetDropAmount(5, LANA_to_LANB, 0)
129 rospy.loginfo(
"updated speed settings")
131 if __name__ ==
"__main__":
132 rospy.init_node(
"drc_2015_environment")
def reconfigure(self, config, level)
high_speed_link_bandwidth
def GetAllFilterNames(mm_hostname)
high_speed_link_blackout_duration
disable_network_limitation
def publishStatus(self, event)
def updateBlackout(self, event)
def SetMM(mm_hostname, bands, a2bfilt_vals, b2afilt_vals, all_filter_names)