[ros-users] rosdep stack dependencies: trunk

Ken Conley kwc at willowgarage.com
Tue Oct 12 15:39:19 UTC 2010


Hi Joao,

'trunk' is not a stack. It usually points to a bad install. It looks
like you are using the 'openrave' install of ROS, which pulls in
numerous, unreleased packages and stacks:

/home/joao/ros/jsk-ros-pkg:
/home/joao/ros/ua-ros-pkg:
/home/joao/ros/ros_tutorials:
/home/joao/ros/cmu-ros-pkg:
/home/joao/ros/trunk_cturtle:
/home/joao/ros/ros_experimental:

The one that's causing the warning "couldn't find" messages that you
see is trunk_cturtle. They are generally harmless, but annoying. We
generally don't recommend checkouts of this full tree.

There is no 'trunk' stack. This error is generally due to a
misconfiguration in an installation. It usually happens when a stack
is checked out as with a directory named 'trunk' instead of its actual
name.

If you are just trying to complete tutorials, I recommend starting
with one of the recommended installations first:
http://www.ros.org/wiki/ROS/Installation

Or, I recommend e-mailing Rosen as I assume the openrave installation
configuration file is his.

 - Ken



On Tue, Oct 12, 2010 at 7:16 AM, joao bimbo <joaommsb at gmail.com> wrote:
> Hello again
> I guess it couldn't find any stack that depends on trunk. The problem goes
> even deeper :(
> joao at joao-desktop:~$ ./findstack.sh
> [rosstack] couldn't find dependency [vslam] of [vision]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [pr2_web_apps] of
> [web_apps_experimental]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [roslisp_common] of [world_db_model]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [collision_environment] of
> [motion_planning_research]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [arm_navigation] of [wg_robots_gazebo]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [arm_navigation] of [policy_learning]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [people] of [people_experimental]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [collision_environment] of
> [pr2_arm_motion_planners]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [pr2_doors] of [pr2_common_alpha]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [executive_smach] of [find_object]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [pr2_self_test] of
> [test_wg_hardware_test_systems]
> [rosstack] missing dependency
> [rosstack] couldn't find dependency [pr2_navigation] of [2dnav_pr2_app]
> [rosstack] missing dependency
> What do I do out of this?
> Cheers
> João
>
> 2010/10/11 Tully Foote <tfoote at willowgarage.com>
>>
>> Hi Joao,
>>
>> It looks like one of your stacks incorrectly depends on the stack trunk.
>> The script below should help you find the problem stack.
>>
>> Tully
>>
>>
>> {{{
>> #!/usr/bin/bash
>>
>> STACKS=`rosstack list-names`
>>
>> for STACK in $STACKS
>> do
>>     DEPS=`rosstack depends1 $STACK`
>>     for D in $DEPS
>>       do
>>         if [ 'trunk' = $D ] ; then
>>             echo $STACK
>>             echo "depends on"
>>             echo $D
>>             echo ""
>>         fi
>>       done
>> done
>> }}}
>>
>> On Mon, Oct 11, 2010 at 10:19 AM, joaozinho <joaommsb at gmail.com> wrote:
>>>
>>> Hello everybody
>>>
>>> I am having a problem going through the "Building Packages" tutorial.
>>> rosdep
>>> cannot locate the stack trunk when installing the dependecies of
>>> turtle_teleop. I hope you can help me with this:
>>>
>>> Input:
>>> joao at joao-desktop:~/ros/ros$ rosdep install turtle_teleop
>>>
>>> Output:
>>> Traceback (most recent call last):
>>>  File "/home/joao/ros/ros/bin/rosdep", line 35, in <module>
>>>    sys.exit(rosdep.main())
>>>  File "/home/joao/ros/ros/tools/rosdep/src/rosdep/main.py", line 141, in
>>> main
>>>    r.install(options.include_duplicates, options.default_yes);
>>>  File "/home/joao/ros/ros/tools/rosdep/src/rosdep/core.py", line 377, in
>>> install
>>>    script = self.generate_script(include_duplicates, default_yes)
>>>  File "/home/joao/ros/ros/tools/rosdep/src/rosdep/core.py", line 340, in
>>> generate_script
>>>    native_packages, scripts = self.get_packages_and_scripts()
>>>  File "/home/joao/ros/ros/tools/rosdep/src/rosdep/core.py", line 312, in
>>> get_packages_and_scripts
>>>    rdlp = RosdepLookupPackage(self.osi.get_name(),
>>> self.osi.get_version(),
>>> p, yc)
>>>  File "/home/joao/ros/ros/tools/rosdep/src/rosdep/core.py", line 168, in
>>> __init__
>>>    self.load_for_package(package, yaml_cache.rp)
>>>  File "/home/joao/ros/ros/tools/rosdep/src/rosdep/core.py", line 194, in
>>> load_for_package
>>>    paths.add( os.path.join(roslib.stacks.get_stack_dir(stack),
>>> "rosdep.yaml"))
>>>  File "/home/joao/ros/ros/core/roslib/src/roslib/stacks.py", line 152, in
>>> get_stack_dir
>>>    raise InvalidROSStackException("Cannot location installation of stack
>>> %s. ROS_ROOT[%s] ROS_PACKAGE_PATH[%s]"%(stack, env[ROS_ROOT],
>>> env.get(ROS_PACKAGE_PATH, '')))
>>> roslib.stacks.InvalidROSStackException: Cannot location installation of
>>> stack trunk. ROS_ROOT[/home/joao/ros/ros]
>>>
>>> ROS_PACKAGE_PATH[/home/joao/ros/stacks/pr2_calibration:/home/joao/ros/jsk-ros-pkg:/home/joao/ros/ua-ros-pkg:/home/joao/ros/ros_tutorials:/home/joao/ros/cmu-ros-pkg:/home/joao/ros/trunk_cturtle:/home/joao/ros/ros_experimental:/home/joao/ros/stacks/motion_planning_common:/home/joao/ros/stacks/robot_calibration:/home/joao/ros/stacks/wifi_drivers:/home/joao/ros/stacks/web_interface:/home/joao/ros/stacks/visualization_common:/home/joao/ros/stacks/visualization:/home/joao/ros/stacks/vision_opencv:/home/joao/ros/stacks/sound_drivers:/home/joao/ros/stacks/slam_gmapping:/home/joao/ros/stacks/simulator_stage:/home/joao/ros/stacks/simulator_gazebo:/home/joao/ros/stacks/robot_model:/home/joao/ros/stacks/pr2_simulator:/home/joao/ros/stacks/pr2_robot:/home/joao/ros/stacks/pr2_power_drivers:/home/joao/ros/stacks/pr2_mechanism:/home/joao/ros/stacks/pr2_gui:/home/joao/ros/stacks/pr2_ethercat_drivers:/home/joao/ros/stacks/pr2_controllers:/home/joao/ros/stacks/pr2_common:/home/joao/ros/stacks/p
>>>
>>>  r2_apps:/home/joao/ros/stacks/physics_ode:/home/joao/ros/stacks/navigation:/home/joao/ros/stacks/laser_pipeline:/home/joao/ros/stacks/laser_drivers:/home/joao/ros/stacks/joystick_drivers:/home/joao/ros/stacks/imu_drivers:/home/joao/ros/stacks/image_transport_plugins:/home/joao/ros/stacks/image_pipeline:/home/joao/ros/stacks/image_common:/home/joao/ros/stacks/geometry:/home/joao/ros/stacks/driver_common:/home/joao/ros/stacks/diagnostics:/home/joao/ros/stacks/common_msgs:/home/joao/ros/stacks/common:/home/joao/ros/stacks/camera_drivers]
>>>
>>> Also, I cannot find a stack called trunk
>>>
>>> joao at joao-desktop:~/ros/ros$ rosstack find trunk
>>> [rosstack] couldn't find stack trunk
>>>
>>> I hope you can help me out
>>> Cheers
>>> Joao
>>>
>>>
>>> --
>>> View this message in context:
>>> http://ros-users.122217.n3.nabble.com/rosdep-stack-dependencies-trunk-tp1682055p1682055.html
>>> Sent from the ROS-Users mailing list archive at Nabble.com.
>>> _______________________________________________
>>> ros-users mailing list
>>> ros-users at code.ros.org
>>> https://code.ros.org/mailman/listinfo/ros-users
>>
>>
>>
>> --
>> Tully Foote
>> Systems Engineer
>> Willow Garage, Inc.
>> tfoote at willowgarage.com
>> (650) 475-2827
>>
>> _______________________________________________
>> ros-users mailing list
>> ros-users at code.ros.org
>> https://code.ros.org/mailman/listinfo/ros-users
>>
>
>
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
>
>



More information about the ros-users mailing list