Skip to content

Invalid parameter "gyroscopoe_random_walk" #9

@ghost

Description

Hi,

I want to launch empty_world using ardupilot_sitl_gazebo_plugin. I run the following command:

roslaunch ardupilot_sitl_gazebo_plugin empty_world.launch

but every time i get the following error:

... logging to /root/.ros/log/a0c374e4-ac84-11e7-8e27-000c2977e7ec/roslaunch-ubuntu-66206.log
Checking log directory for disk usage. This may take awhile.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

xacro: Traditional processing is deprecated. Switch to --inorder processing!
To check for compatibility of your document, use option --check-order.
For more infos, see http://wiki.ros.org/xacro#Processing_Order
redefining global property: pi
when processing file: /home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro
Invalid parameter "gyroscopoe_random_walk"
XacroException('Invalid parameter "gyroscopoe_random_walk"',)
when instantiating macro: imu_plugin_macro (/home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro)
in file: /home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro
while processing /home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/launch/iris_spawn.launch:
Invalid <param> tag: Cannot load command parameter [robot_description]: command [     /opt/ros/lunar/share/xacro/xacro.py '/home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro'     enable_logging:=true     enable_ground_truth:=true     log_file:=iris] returned with code [2]. 

Param xml is <param command="     $(find xacro)/xacro.py '$(arg model)'     enable_logging:=$(arg enable_logging)     enable_ground_truth:=$(arg enable_ground_truth)     log_file:=$(arg log_file)" name="robot_description"/>
The traceback for the exception was written to the log file

when i remove gyroscopoe_random_walk and accelerometer_random_walk from the iris_base.xacro file I get another error:

... logging to /root/.ros/log/6c3dc610-ac85-11e7-8e27-000c2977e7ec/roslaunch-ubuntu-66247.log
Checking log directory for disk usage. This may take awhile.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

xacro: Traditional processing is deprecated. Switch to --inorder processing!
To check for compatibility of your document, use option --check-order.
For more infos, see http://wiki.ros.org/xacro#Processing_Order
redefining global property: pi
when processing file: /home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro
Undefined parameters [gyroscope_random_walk,accelerometer_random_walk]
XacroException(u'Undefined parameters [gyroscope_random_walk,accelerometer_random_walk]',)
when instantiating macro: imu_plugin_macro (/home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro)
in file: /home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro
while processing /home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/launch/iris_spawn.launch:
Invalid <param> tag: Cannot load command parameter [robot_description]: command [     /opt/ros/lunar/share/xacro/xacro.py '/home/mahdi/catkin_ws2/src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro'     enable_logging:=true     enable_ground_truth:=true     log_file:=iris] returned with code [2]. 

Param xml is <param command="     $(find xacro)/xacro.py '$(arg model)'     enable_logging:=$(arg enable_logging)     enable_ground_truth:=$(arg enable_ground_truth)     log_file:=$(arg log_file)" name="robot_description"/>
The traceback for the exception was written to the log file

when I try to check for compatibility using xacro --check-order src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro command i get the following lines:

redefining global property: pi
when processing file: /home/mahdi/catkin_ws2/src/rotors_simulator/rotors_description/urdf/component_snippets.xacro
included from: src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro
Invalid parameter "gyroscopoe_random_walk"
XacroException('Invalid parameter "gyroscopoe_random_walk"',)
when instantiating macro: imu_plugin_macro (/home/mahdi/catkin_ws2/src/rotors_simulator/rotors_description/urdf/component_snippets.xacro)
in file: src/ardupilot_sitl_gazebo_plugin/urdf/iris_base.xacro

I've been working on this issue for several hours but I've got nothing. Please help me. Thanks for your consideration.

Metadata

Metadata

Assignees

No one assigned

    Labels

    No labels
    No labels

    Projects

    No projects

    Milestone

    No milestone

    Relationships

    None yet

    Development

    No branches or pull requests

    Issue actions