[ros-users] install individual ros packages - urdf / kdl
Ugo Cupcic
ugo at shadowrobot.com
Wed Mar 24 17:43:18 UTC 2010
Dear Tully,
Here is the error I get when trying to run rosdep install robot_model:
rosdep install robot_model
Warning: could not identify ['robot_model'] as a package
Usage: rosdep [options] <command> <args>
Commands:
rosdep generate_bash <packages>...
rosdep satisfy <packages>...
will try to generate a bash script which will satisfy the
dependencies of package(s) on your operating system.
rosdep install <packages>...
will generate a bash script and then execute it.
rosdep depdb <packages>...
will generate the dependency database for package(s) and print
it to the console (note that the database will change depending
on which package(s) you query.
rosdep what_needs <rosdeps>...
will print a list of packages that declare a rosdep on (at least
one of) ROSDEP_NAME[S]
rosdep where_defined <rosdeps>...
will print a list of yaml files that declare a rosdep on (at least
one of) ROSDEP_NAME[S]
rosdep check <packages>...
will check if the dependencies of package(s) have been met.
rosdep: error: No Valid Packages listed
When I try to run: rosmake robot_model, I get the following error:
[ rosmake ] Packages requested are: ['robot_model']
[ rosmake ] Logging to directory
[ rosmake ] /home/hand/.ros/rosmake/rosmake_output-20100324-174008
[ rosmake ] Expanded args ['robot_model'] to:
[]
[ rosmake ] WARNING: The following args could not be parsed as stacks or
packages: ['robot_model']
[ rosmake ] ERROR: No arguments could be parsed into valid package or
stack names.
To set up my environment:
- I ran the rosinstall command: ~/rosinstall ~/ros
http://ros.org/rosinstalls/boxturtle_base.rosinstall
- then make in ~/ros/ros
- then exported the different variables for ros to my .bashrc.
- then 'rosmake roscpp' and 'rosmake rospy' and 'rosmake std_msgs'
The roscore is working fine, I have access to rxconsole, etc...
Cheers,
Ugo
Tully Foote wrote:
> Ugo,
> Can you provide the specific error with context leading up to getting
> it(such as setting up your environment)? I'm not sure what kind of "not
> found error" you are getting?
>
> Tully
>
> On Wed, Mar 24, 2010 at 2:48 AM, Ugo Cupcic <ugo at shadowrobot.com
> <mailto:ugo at shadowrobot.com>> wrote:
>
> Hi Tully,
>
> Thanks for your answer. The weird thing is that I already installed the
> boxturtle_base one (running : ~/rosinstall ~/ros
> http://ros.org/rosinstalls/boxturtle_base.rosinstall).
>
> I tried both those commands (and the same ones with urdf / kdl) but each
> time it said the package was not found :S
> rosdep install robot_model
> rosmake robot_model
>
> Any ideas ?
>
> By the way, I'm on debian.
>
> Cheers,
>
> Ugo
>
> Tully Foote wrote:
> > Ugo,
> > You can install any stack individually. The urdf parsing is in the
> > robot_model stack and kdl is in the geometry stack.
> >
> > Both are in the boxturtle base installation which doesn't pull
> anything
> > pr2 specific. See http://www.ros.org/wiki/ROS/Installation/Ubuntu
> >
> > If you want a truly minimal set you can pull only the stacks up
> to that
> > level. To do that I recommend trimming the boxturtle base rosinstall
> > file at http://ros.org/rosinstalls/boxturtle_base.rosinstall to only
> > have the following stacks
> >
> > {{{
> > $ rosstack depends robot_model
> > ros
> > common_msgs
> > common
> > geometry
> > }}}
> >
> > However I would recommend just pulling the boxturtle base install
> > http://www.ros.org/wiki/ROS/Installation/Ubuntu
> >
> > And if you're on Ubuntu you could also use the debian based
> install and
> > just install ros-boxturtle-robot-model package.
> >
> > Tully
> >
> > On Tue, Mar 23, 2010 at 10:38 AM, Ugo Cupcic <ugo at shadowrobot.com
> <mailto:ugo at shadowrobot.com>
> > <mailto:ugo at shadowrobot.com <mailto:ugo at shadowrobot.com>>> wrote:
> >
> > Hi all,
> >
> > Is it possible to install urdf and kdl for ros, without having to
> > install the whole pr2 stuff? (if yes, how can I do that ?)
> >
> > Cheers,
> >
> > Ugo
> >
> > --
> > Ugo Cupcic | Shadow Robot Company |
> ugo at shadowrobot.com <mailto:ugo at shadowrobot.com>
> > <mailto:ugo at shadowrobot.com <mailto:ugo at shadowrobot.com>>
> > Software Engineer 251 Liverpool Road
> > need a Hand? London N1 1LX | +44 20 7700 2487
> > http://www.shadowrobot.com/hand/ @shadowrobot
> >
> > _______________________________________________
> > ros-users mailing list
> > ros-users at code.ros.org <mailto:ros-users at code.ros.org>
> <mailto:ros-users at code.ros.org <mailto: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 <mailto:tfoote at willowgarage.com>
> <mailto:tfoote at willowgarage.com <mailto:tfoote at willowgarage.com>>
> > (650) 475-2827
> >
> >
> >
> ------------------------------------------------------------------------
> >
> > _______________________________________________
> > ros-users mailing list
> > ros-users at code.ros.org <mailto:ros-users at code.ros.org>
> > https://code.ros.org/mailman/listinfo/ros-users
>
>
> --
> Ugo Cupcic | Shadow Robot Company | ugo at shadowrobot.com
> <mailto:ugo at shadowrobot.com>
> Software Engineer 251 Liverpool Road
> need a Hand? London N1 1LX | +44 20 7700 2487
> http://www.shadowrobot.com/hand/ @shadowrobot
>
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org <mailto: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 <mailto: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
--
Ugo Cupcic | Shadow Robot Company | ugo at shadowrobot.com
Software Engineer 251 Liverpool Road
need a Hand? London N1 1LX | +44 20 7700 2487
http://www.shadowrobot.com/hand/ @shadowrobot
More information about the ros-users
mailing list