# extended calibration
calibration_magn_use_extended: true
-magn_ellipsoid_center: [164.907, 212.010, 16.4033]
-magn_ellipsoid_transform: [[0.977989, 0.00268088, 0.0115993], [0.00268088, 0.974660, 0.0151645], [0.0115993, 0.0151645, 0.982901]]
+magn_ellipsoid_center: [192.863, 93.3924, -413.187]
+magn_ellipsoid_transform: [[0.969535, 0.00462330, 0.0198726], [0.00462330, 0.964774, 0.0291415], [0.0198726, 0.0291415, 0.957085]]
# AHRS to robot calibration
imu_yaw_calibration: 0.0
<rosparam command="load" file="$(find wild_thumper)/cfg/analyzers.yaml" />
</node>
+ <node pkg="wild_thumper" type="move_base.py" name="move_base" output="screen" respawn="true">
+ <param name="enable_odom_tf" value="false" />
+ </node>
+
<node pkg="razor_imu_9dof" type="imu_node.py" name="imu_node" output="screen">
<rosparam file="$(find wild_thumper)/cfg/razor.yaml" command="load"/>
</node>
- <node pkg="wild_thumper" type="move_base.py" name="move_base" output="screen" respawn="true" />
-
<node pkg="robot_pose_ekf" type="robot_pose_ekf" name="robot_pose_ekf" output="screen">
<remap from="imu_data" to="imu"/>
<param name="output_frame" value="odom"/>
rospy.init_node('wild_thumper_move_base')
rospy.Subscriber("cmd_vel", Twist, self.cmdVelReceived)
rospy.Subscriber("imu", Imu, self.imuReceived)
- #self.tf_broadcaster = tf.broadcaster.TransformBroadcaster()
+ enable_odom_tf = rospy.get_param("~enable_odom_tf", True)
+ if enable_odom_tf:
+ self.tf_broadcaster = tf.broadcaster.TransformBroadcaster()
+ else:
+ self.tf_broadcaster = None
self.pub_odom = rospy.Publisher("odom", Odometry, queue_size=16)
self.pub_diag = rospy.Publisher("diagnostics", DiagnosticArray, queue_size=16)
self.set_speed(0, 0)
odom_quat = tf.transformations.quaternion_from_euler(0, 0, angle)
# first, we'll publish the transform over tf
- #self.tf_broadcaster.sendTransform((posx, posy, 0.0), odom_quat, current_time, "base_footprint", "odom")
+ if self.tf_broadcaster is not None:
+ self.tf_broadcaster.sendTransform((posx, posy, 0.0), odom_quat, current_time, "base_footprint", "odom")
# next, we'll publish the odometry message over ROS
odom = Odometry()
odom.pose.pose.orientation.w = odom_quat[3]
odom.pose.covariance[0] = 1e-3 # x
odom.pose.covariance[7] = 1e-3 # y
- odom.pose.covariance[14] = 1e-3 # z
- odom.pose.covariance[21] = 0.1 # rotation about X axis
- odom.pose.covariance[28] = 0.1 # rotation about Y axis
+ odom.pose.covariance[14] = 1e6 # z
+ odom.pose.covariance[21] = 1e6 # rotation about X axis
+ odom.pose.covariance[28] = 1e6 # rotation about Y axis
odom.pose.covariance[35] = 0.1 # rotation about Z axis
# set the velocity
odom.twist.twist.angular.z = speed_rot
odom.twist.covariance[0] = 1e-3 # x
odom.twist.covariance[7] = 1e-3 # y
- odom.twist.covariance[14] = 1e-3 # z
- odom.twist.covariance[21] = 0.1 # rotation about X axis
- odom.twist.covariance[28] = 0.1 # rotation about Y axis
+ odom.twist.covariance[14] = 1e6 # z
+ odom.twist.covariance[21] = 1e6 # rotation about X axis
+ odom.twist.covariance[28] = 1e6 # rotation about Y axis
odom.twist.covariance[35] = 0.1 # rotation about Z axis
# publish the message