ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question

Revision history [back]

Here is a list of packages (distro FUERTE)that I've been able to compile on the Pandaboard with ubuntu 12.04:

actionlib
actionlib_msgs
amcl
angles
base_local_planner
beginner_tutorials
bfl
bond
bondcpp
bondpy
bullet
camera_calibration_parsers
camera_info_manager
carrot_planner
clear_costmap_recovery
collada_parser
collada_urdf
colladadom
common_rosdeps
convex_decomposition
costmap_2d
cpp_common
diagnostic_aggregator
diagnostic_analysis
diagnostic_msgs
diagnostic_updater
driver_base
dwa_local_planner
dynamic_reconfigure
eigen_conversions
fake_localization
filters
geometry_msgs
gmapping
hokuyo_node
image_transport
ivcon
kdl
kdl_parser
laser_assembler
laser_filters
laser_geometry
learning_image_transport
map_server
message_filters
mk
move_base
move_base_msgs
move_slow_and_clear
nav_core
nav_msgs
navfn
nodelet
nodelet_topic_tools
orocos_kdl
pcl_ros
perf_roscpp
pluginlib
polled_camera
python_orocos_kdl
resource_retriever
robot_pose_ekf
robot_state_publisher
rosbag
rosbash
rosboost_cfg
rosbuild
rosclean
rosconsole
roscpp
roscpp_serialization
roscpp_traits
roscreate
rosgraph
rosgraph_msgs
roslang
roslaunch
roslib
roslisp
rosmake
rosmaster
rosmsg
rosnode
rosout
rospack
rosparam
rospy
rosservice
rostest
rostime
rostopic
rosunit
roswtf
rotate_recovery
self_test
sensor_msgs
shape_msgs
sicktoolbox
sicktoolbox_wrapper
simmechanics_to_urdf
smach
smach_msgs
smach_ros
smclib
srdf
std_msgs
std_srvs
stereo_msgs
test_bond
test_crosspackage
test_diagnostic_aggregator
test_nodelet
test_ros
test_rosbag
test_roscpp
test_roscpp_serialization
test_roscpp_serialization_perf
test_roslib_comm
test_rospy
test_rosservice
test_rostime
tf
tf_conversions
timestamp_tools
topic_tools
trajectory_msgs
urdf
urdf_interface
urdf_parser
visualization_msgs
voxel_grid
xacro
xmlrpcpp

If you want to go the Groovy way I warn you you'll find a bit more problems. I stopped short of the Mobile variant due to problems with collada: you have to download the source package and compile it before being able to compile most of the parsers, still haven't had time to do that. And as you found out already you have to download and compile yaml-cpp 0.2.7 (don't forget a sudo make install at the end, otherwise nobody will be able to find it).

Also I'm not sure if running a rosdep update is any use when you change what is available on your system. For not knowing it, I run it anyway.