3 roslib.load_manifest(
'mini_maxwell')
6 from mm2client
import *
8 from dynamic_reconfigure.server
import Server
as DynamicReconfigureServer
9 from mini_maxwell.cfg
import RosClientConfig
as ConfigType
24 rospy.logwarn(
'[usage] rosrun mini_maxwell ros_client.py _ip:=[mini_maxwell ip or hostname] _round_trimp:=[round trip(ms)] _rate_limit:=[rate limit(bps)]')
25 self.
mm2name = rospy.get_param(
'~ip',
'192.168.0.5')
29 rospy.loginfo(
'mm2 hostname or ip = %s', self.
mm2name)
48 self.bnds.SetDelayReorder(self.
band_number,
True,
False)
49 self.bnds.SetDelayReorder(self.
band_number,
False,
False)
51 rospy.loginfo(
'round_trip = %s', self.
round_trip)
52 rospy.loginfo(
'rate_limit = %s', self.
rate_limit)
57 if __name__ ==
'__main__':
58 rospy.init_node(
'mini_maxwell_client')
62 except rospy.ROSInterruptException:
pass
def ChangeBandsOnMM(bandsobj, mm2host)
def reconfigure(self, config, level)
def GetCurrentBands(mm2name)