No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc...) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use \'d\' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
apriltag_ros github-AprilRobotics-apriltag_ros
ground_dds_ros_bridge github-nasa-astrobee
mapper github-nasa-astrobee
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
class_loader github-ros-class_loader
cob_mecanum_controller github-4am-robotics-cob_control
cob_model_identifier github-4am-robotics-cob_control
cob_twist_controller github-4am-robotics-cob_control
collada_urdf github-ros-collada_urdf
control_toolbox github-ros-controls-control_toolbox
dynamixel_workbench_controllers github-ROBOTIS-GIT-dynamixel-workbench
dynamixel_workbench_operators github-ROBOTIS-GIT-dynamixel-workbench
ecl_eigen github-stonier-ecl_core
eigen_stl_containers github-ros-eigen_stl_containers
exotica_core github-ipab-slmc-exotica
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
tf2_eigen github-ros-geometry2
tf2_kdl github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
graft github-ros-perception-graft
hebi_cpp_api github-HebiRobotics-hebi_cpp_api_ros
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
depth_image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
eus_nlopt github-jsk-ros-pkg-jsk_control
eus_qp github-jsk-ros-pkg-jsk_control
jsk_ik_server github-jsk-ros-pkg-jsk_control
euscollada github-jsk-ros-pkg-jsk_model_tools
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kdl_parser github-ros-kdl_parser
swri_geometry_util github-swri-robotics-marti_common
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
test_mavros github-mavlink-mavros
ros_core github-ros-metapackages
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
move_base_swp github-ihadzic-move_base_swp
pilz_industrial_motion_planner github-ros-planning-moveit
moveit_visual_tools github-ros-planning-moveit_visual_tools
mrpt_ekf_slam_3d github-mrpt-ros-pkg-mrpt_slam
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
neo_local_planner github-neobotix-neo_local_planner
nodelet github-ros-nodelet_core
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
ntpd_driver github-vooon-ntpd_driver
ov_core github-rpng-open_vins
ov_eval github-rpng-open_vins
ov_init github-rpng-open_vins
ov_msckf github-rpng-open_vins
parameter_pa github-tuc-proaut-ros_parameter
pilz_utils github-PilzDE-pilz_common
pilz_control github-PilzDE-pilz_robots
prbt_hardware_support github-PilzDE-pilz_robots
prbt_support github-PilzDE-pilz_robots
pluginlib github-ros-pluginlib
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-pr2-pr2_mechanism
pr2_mechanism_model github-pr2-pr2_mechanism
psen_scan_v2 github-PilzDE-psen_scan_v2
qt_gui_cpp github-ros-visualization-qt_gui_core
robot_localization github-cra-ros-pkg-robot_localization
robot_self_filter github-pr2-robot_self_filter
robotis_manipulator github-ROBOTIS-GIT-robotis_manipulator
roswtf github-ros-ros_comm
transmission_interface github-ros-controls-ros_control
ros_control_boilerplate github-PickNikRobotics-ros_control_boilerplate
rosmon_core github-xqms-rosmon
rospack github-ros-rospack
rosparam_shortcuts github-PickNikRobotics-rosparam_shortcuts
rviz github-ros-visualization-rviz
rviz_animated_view_controller github-ros-visualization-rviz_animated_view_controller
simple_grasping github-mikeferguson-simple_grasping
slam_toolbox github-SteveMacenski-slam_toolbox
srdfdom github-ros-planning-srdfdom
steering_functions github-hbanzhaf-steering_functions
teb_local_planner github-rst-tu-dortmund-teb_local_planner
trac_ik_lib bitbucket-traclabs-trac_ik
urdf github-ros-urdf
velo2cam_calibration github-beltransen-velo2cam_calibration
flatland_msgs github-avidbots-flatland
flatland_plugins github-avidbots-flatland
flatland_server github-avidbots-flatland
flatland_viz github-avidbots-flatland

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc...) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use \'d\' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
class_loader github-ros-class_loader
collada_urdf github-ros-collada_urdf
control_toolbox github-ros-controls-control_toolbox
eigen_stl_containers github-ros-eigen_stl_containers
euslisp github-tork-a-euslisp-release
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
generic_control_toolbox github-diogoalmeida-generic_control_toolbox
tf2_eigen github-ros-geometry2
tf2_kdl github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
depth_image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
euscollada github-jsk-ros-pkg-jsk_model_tools
kdl_parser github-ros-kdl_parser
swri_geometry_util github-swri-robotics-marti_common
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
test_mavros github-mavlink-mavros
ros_core github-ros-metapackages
moveit_ros_planning github-ros-planning-moveit
moveit_visual_tools github-ros-planning-moveit_visual_tools
mrpt_ekf_slam_3d github-mrpt-ros-pkg-mrpt_slam
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nodelet github-ros-nodelet_core
ntpd_driver github-vooon-ntpd_driver
parameter_pa github-tuc-proaut-ros_parameter
pcl_ros github-ros-perception-perception_pcl
pluginlib github-ros-pluginlib
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-pr2-pr2_mechanism
pr2_mechanism_model github-pr2-pr2_mechanism
qt_gui_cpp github-ros-visualization-qt_gui_core
robot_localization github-cra-ros-pkg-robot_localization
robot_self_filter github-PR2-robot_self_filter
roswtf github-ros-ros_comm
transmission_interface github-ros-controls-ros_control
ros_control_boilerplate github-davetcoleman-ros_control_boilerplate
gripper_action_controller github-ros-controls-ros_controllers
joint_trajectory_controller github-ros-controls-ros_controllers
rosmon_core github-xqms-rosmon
rospack github-ros-rospack
rosparam_shortcuts github-davetcoleman-rosparam_shortcuts
rviz github-ros-visualization-rviz
srdfdom github-ros-planning-srdfdom
teb_local_planner github-rst-tu-dortmund-teb_local_planner
trac_ik_lib bitbucket-traclabs-trac_ik
urdf github-ros-urdf
velo2cam_calibration github-beltransen-velo2cam_calibration
ensenso github-crigroup-ensenso
pcl_conversions github-ros-perception-pcl_conversions
eigen_typekit github-orocos-rtt_geometry
rtt_rosclock github-orocos-rtt_ros_integration

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc...) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use \'d\' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
bondcpp github-ros-bond_core
class_loader github-ros-class_loader
collada_urdf github-ros-collada_urdf
control_toolbox github-ros-controls-control_toolbox
eigen_stl_containers github-ros-eigen_stl_containers
euslisp github-tork-a-euslisp-release
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geometric_shapes github-ros-planning-geometric_shapes
tf2_eigen github-ros-geometry2
tf2_kdl github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
graft github-ros-perception-graft
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
depth_image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
eus_nlopt github-jsk-ros-pkg-jsk_control
eus_qp github-jsk-ros-pkg-jsk_control
jsk_ik_server github-jsk-ros-pkg-jsk_control
euscollada github-jsk-ros-pkg-jsk_model_tools
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kdl_parser github-ros-kdl_parser
swri_geometry_util github-swri-robotics-marti_common
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
test_mavros github-mavlink-mavros
ros_core github-ros-metapackages
moveit_experimental github-ros-planning-moveit
moveit_planners_chomp github-ros-planning-moveit
moveit_visual_tools github-davetcoleman-moveit_visual_tools
mrpt_ekf_slam_3d github-mrpt-ros-pkg-mrpt_slam
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nodelet github-ros-nodelet_core
ntpd_driver github-vooon-ntpd_driver
parameter_pa github-peterweissig-ros_parameter
pcl_ros github-ros-perception-perception_pcl
pluginlib github-ros-pluginlib
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-pr2-pr2_mechanism
pr2_mechanism_model github-pr2-pr2_mechanism
robot_localization github-cra-ros-pkg-robot_localization
robot_self_filter github-pr2-robot_self_filter
robot_state_publisher github-ros-robot_state_publisher
roswtf github-ros-ros_comm
transmission_interface github-ros-controls-ros_control
ros_control_boilerplate github-davetcoleman-ros_control_boilerplate
gripper_action_controller github-ros-controls-ros_controllers
joint_trajectory_controller github-ros-controls-ros_controllers
rospack github-ros-rospack
rosparam_shortcuts github-davetcoleman-rosparam_shortcuts
rotors_comm github-ethz-asl-rotors_simulator
rotors_control github-ethz-asl-rotors_simulator
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rotors_hil_interface github-ethz-asl-rotors_simulator
rtmbuild github-start-jsk-rtmros_common
rviz github-ros-visualization-rviz
rviz_visual_tools github-davetcoleman-rviz_visual_tools
slam_karto github-ros-perception-slam_karto
sparse_bundle_adjustment github-ros-perception-sparse_bundle_adjustment
srdfdom github-ros-planning-srdfdom
teb_local_planner github-rst-tu-dortmund-teb_local_planner
trac_ik_lib bitbucket-traclabs-trac_ik
ecto_image_pipeline github-plasmodic-ecto_image_pipeline
ecto_ros github-plasmodic-ecto_ros
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
gravity_compensation github-kth-ros-pkg-force_torque_tools
geonav_transform github-bsb808-geonav_transform
grizzly_motion github-g-grizzly
grizzly_msgs github-g-grizzly
hector_elevation_visualization github-tu-darmstadt-ros-pkg-hector_navigation
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
hector_quadrotor_model github-tu-darmstadt-ros-pkg-hector_quadrotor
object_recognition_core github-wg-perception-object_recognition_core
object_recognition_reconstruction github-wg-perception-reconstruction
object_recognition_ros github-wg-perception-object_recognition_ros
object_recognition_tod github-wg-perception-tod
pcl_conversions github-ros-perception-pcl_conversions
urdf github-ros-robot_model
eigen_typekit github-orocos-rtt_geometry
rtt_rosclock github-orocos-rtt_ros_integration
rtt_rosparam github-orocos-rtt_ros_integration
stdr_parser github-stdr-simulator-ros-pkg-stdr_simulator
stereo_slam github-srv-stereo_slam
camera_handler github-lagadic-vrep_ros_bridge
force_sensor_handler github-lagadic-vrep_ros_bridge
imu_handler github-lagadic-vrep_ros_bridge
manipulator_handler github-lagadic-vrep_ros_bridge
quadrotor_handler github-lagadic-vrep_ros_bridge
quadrotor_tk_handler github-lagadic-vrep_ros_bridge
rigid_body_handler github-lagadic-vrep_ros_bridge
vrep_ros_plugin github-lagadic-vrep_ros_bridge
aubo_trajectory github-auboliuxin-aubo_robot
freefloating_gazebo github-freefloating-gazebo-freefloating_gazebo
libhaloc github-srv-libhaloc
object_recognition_tabletop github-wg-perception-tabletop
rqt_stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D
stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D
tf_keyboard_cal github-davetcoleman-tf_keyboard_cal
microstrain_mips github-bsb808-microstrain_3dm_gx5_45

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.3.3
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.3-devel
Last Updated 2014-12-23
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

Provided Modules

  1. Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.
  2. NumPy is the fundamental package for scientific computing with Python.
  3. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  4. TinyXML is a simple, small, C++ XML parser.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find Eigen by using the following:

find_package(Eigen REQUIRED)

Lookup sheet

Eigen
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL

find_package(GSL REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
asr_descriptor_surface_based_recognition github-asr-ros-asr_descriptor_surface_based_recognition
asr_fake_object_recognition github-asr-ros-asr_fake_object_recognition
asr_ftc_local_planner github-asr-ros-asr_ftc_local_planner
asr_kinematic_chain_optimizer github-asr-ros-asr_kinematic_chain_optimizer
asr_mild_calibration_tool github-asr-ros-asr_mild_calibration_tool
asr_navfn github-asr-ros-asr_navfn
asr_object_database github-asr-ros-asr_object_database
asr_robot_model_services github-asr-ros-asr_robot_model_services
asr_sick_lms_400 github-asr-ros-asr_sick_lms_400
asr_visualization_server github-asr-ros-asr_visualization_server
ati_force_torque github-iirob-ati_force_torque
bondcpp github-ros-bond_core
class_loader github-ros-class_loader
cob_model_identifier github-ipa320-cob_control
cob_obstacle_distance github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
cob_camera_sensors github-ipa320-cob_driver
cob_obstacle_distance_moveit github-ipa320-cob_manipulation
collada_urdf github-ros-collada_urdf
control_toolbox github-ros-controls-control_toolbox
eband_local_planner github-utexas-bwi-eband_local_planner
ecl_eigen github-stonier-ecl_core
eigen_stl_containers github-ros-eigen_stl_containers
euslisp github-tork-a-euslisp-release
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
generic_control_toolbox github-diogoalmeida-generic_control_toolbox
geometric_shapes github-ros-planning-geometric_shapes
tf2_eigen github-ros-geometry2
tf2_kdl github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
graft github-ros-perception-graft
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
depth_image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
eus_nlopt github-jsk-ros-pkg-jsk_control
eus_qp github-jsk-ros-pkg-jsk_control
jsk_ik_server github-jsk-ros-pkg-jsk_control
euscollada github-jsk-ros-pkg-jsk_model_tools
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kdl_parser github-ros-kdl_parser
swri_geometry_util github-swri-robotics-marti_common
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
test_mavros github-mavlink-mavros
ros_core github-ros-metapackages
microstrain_mips github-ros-drivers-microstrain_mips
moveit_core github-ros-planning-moveit
moveit_experimental github-ros-planning-moveit
moveit_planners_chomp github-ros-planning-moveit
moveit_ros_benchmarks_gui github-ros-planning-moveit
moveit_ros_manipulation github-ros-planning-moveit
moveit_ros_perception github-ros-planning-moveit
moveit_ros_planning github-ros-planning-moveit
moveit_ros_planning_interface github-ros-planning-moveit
moveit_ros_visualization github-ros-planning-moveit
pr2_moveit_plugins github-ros-planning-moveit_pr2
moveit_tutorials github-ros-planning-moveit_tutorials
moveit_visual_tools github-davetcoleman-moveit_visual_tools
mrpt_ekf_slam_3d github-mrpt-ros-pkg-mrpt_slam
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
map_organizer github-at-wat-neonavigation
safety_limiter github-at-wat-neonavigation
track_odometry github-at-wat-neonavigation
nodelet github-ros-nodelet_core
ntpd_driver github-vooon-ntpd_driver
parameter_pa github-tuc-proaut-ros_parameter
pcl_ros github-ros-perception-perception_pcl
pluginlib github-ros-pluginlib
laser_joint_projector github-PR2-pr2_calibration
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-pr2-pr2_mechanism
pr2_mechanism_model github-pr2-pr2_mechanism
robot_localization github-cra-ros-pkg-robot_localization
robot_self_filter github-pr2-robot_self_filter
robot_state_publisher github-ros-robot_state_publisher
roswtf github-ros-ros_comm
transmission_interface github-ros-controls-ros_control
ros_control_boilerplate github-davetcoleman-ros_control_boilerplate
gripper_action_controller github-ros-controls-ros_controllers
joint_trajectory_controller github-ros-controls-ros_controllers
rospack github-ros-rospack
rosparam_shortcuts github-davetcoleman-rosparam_shortcuts
rotors_comm github-ethz-asl-rotors_simulator
rotors_control github-ethz-asl-rotors_simulator
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rtmbuild github-start-jsk-rtmros_common
rviz github-ros-visualization-rviz
rviz_visual_tools github-davetcoleman-rviz_visual_tools
slam_karto github-ros-perception-slam_karto
sparse_bundle_adjustment github-ros-perception-sparse_bundle_adjustment
srdfdom github-ros-planning-srdfdom
teb_local_planner github-rst-tu-dortmund-teb_local_planner
trac_ik_lib bitbucket-traclabs-trac_ik
urdf github-ros-urdf
depth_sensor_pose github-mdrwiega-depth_nav_tools
ecto_image_pipeline github-plasmodic-ecto_image_pipeline
ecto_ros github-plasmodic-ecto_ros
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
gravity_compensation github-kth-ros-pkg-force_torque_tools
geonav_transform github-bsb808-geonav_transform
grizzly_motion github-g-grizzly
grizzly_msgs github-g-grizzly
handle_detector github-atenpas-handle_detector
hector_elevation_visualization github-tu-darmstadt-ros-pkg-hector_navigation
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
hector_quadrotor_model github-tu-darmstadt-ros-pkg-hector_quadrotor
humanoid_localization github-AravindaDP-humanoid_navigation
kuka_eki_hw_interface github-ros-industrial-kuka_experimental
kuka_rsi_hw_interface github-ros-industrial-kuka_experimental
object_recognition_core github-wg-perception-object_recognition_core
object_recognition_reconstruction github-wg-perception-reconstruction
object_recognition_ros github-wg-perception-object_recognition_ros
object_recognition_tod github-wg-perception-tod
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
lgsm github-tu-rbo-omip
omip_common github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
shape_reconstruction github-tu-rbo-omip
shape_tracker github-tu-rbo-omip
pcl_conversions github-ros-perception-pcl_conversions
eigen_typekit github-orocos-rtt_geometry
rtt_rosclock github-orocos-rtt_ros_integration
rtt_rosparam github-orocos-rtt_ros_integration
sophus_ros_conversions github-stonier-sophus_ros_toolkit
stdr_parser github-stdr-simulator-ros-pkg-stdr_simulator
tango_ros_native github-Intermodalics-tango_ros
turtlebot_actions github-turtlebot-turtlebot_apps
turtlebot_arm_ikfast_plugin github-turtlebot-turtlebot_arm
turtlebot_arm_kinect_calibration github-turtlebot-turtlebot_arm
agile_grasp github-atenpas-agile_grasp
apriltags github-RIVeR-Lab-apriltags_ros
apriltags_ros github-RIVeR-Lab-apriltags_ros
asctec_hl_gps github-ethz-asl-asctec_mav_framework
asctec_hl_interface github-ethz-asl-asctec_mav_framework
bwi_tools github-utexas-bwi-bwi_common
descartes_core github-ros-industrial-consortium-descartes
descartes_moveit github-ros-industrial-consortium-descartes
descartes_planner github-ros-industrial-consortium-descartes
descartes_trajectory github-ros-industrial-consortium-descartes
interaction_cursor_3d github-aleeper-interaction_cursor_3d
interaction_cursor_demo github-aleeper-interaction_cursor_3d
libfovis github-srv-libfovis
baxter_ikfast_left_arm_plugin github-ros-planning-moveit_robots
baxter_ikfast_right_arm_plugin github-ros-planning-moveit_robots
moveit_simple_grasps github-davetcoleman-moveit_simple_grasps
ros_ethercat_model github-shadow-robot-ros_ethercat
rviz_fixed_view_controller github-ros-visualization-rviz_fixed_view_controller
stereo_slam github-srv-stereo_slam
camera_handler github-lagadic-vrep_ros_bridge
force_sensor_handler github-lagadic-vrep_ros_bridge
imu_handler github-lagadic-vrep_ros_bridge
manipulator_handler github-lagadic-vrep_ros_bridge
quadrotor_handler github-lagadic-vrep_ros_bridge
quadrotor_tk_handler github-lagadic-vrep_ros_bridge
rigid_body_handler github-lagadic-vrep_ros_bridge
vrep_ros_plugin github-lagadic-vrep_ros_bridge
aubo_trajectory github-auboliuxin-aubo_robot
baxter_sim_hardware github-RethinkRobotics-baxter_simulator
baxter_sim_kinematics github-RethinkRobotics-baxter_simulator
camera_pose_calibration github-delftrobotics-camera_pose_calibration
carl_moveit github-GT-RAIL-carl_moveit
freefloating_gazebo github-freefloating-gazebo-freefloating_gazebo
homer_map_manager gitlab-uni-koblenz-robbie-homer_mapnav
homer_mapnav_msgs gitlab-uni-koblenz-robbie-homer_mapnav
homer_mapping gitlab-uni-koblenz-robbie-homer_mapnav
homer_nav_libs gitlab-uni-koblenz-robbie-homer_mapnav
homer_navigation gitlab-uni-koblenz-robbie-homer_mapnav
or_libs gitlab-uni-koblenz-robbie-homer_object_recognition
or_msgs gitlab-uni-koblenz-robbie-homer_object_recognition
or_nodes gitlab-uni-koblenz-robbie-homer_object_recognition
robot_face gitlab-uni-koblenz-robbie-homer_robot_face
point_cloud_reducer github-CIR-KIT-human_detector
constrained_ik github-ros-industrial-industrial_moveit
industrial_collision_detection github-ros-industrial-industrial_moveit
stomp_core github-ros-industrial-industrial_moveit
stomp_moveit github-ros-industrial-industrial_moveit
stomp_plugins github-ros-industrial-industrial_moveit
jsk_apc2016_common github-start-jsk-jsk_apc
drc_com_common github-jsk-ros-pkg-jsk_demos
drc_valve_task github-jsk-ros-pkg-jsk_demos
jsk_smart_gui github-jsk-ros-pkg-jsk_smart_apps
laser_odometry_core github-artivis-laser_odometry
libhaloc github-srv-libhaloc
object_recognition_tabletop github-wg-perception-tabletop
rgbdslam github-felixendres-rgbdslam_v2
robbie_architecture gitlab-uni-koblenz-robbie-robbie_architecture
robot_markers github-jstnhuang-robot_markers
romeo_moveit_actions github-ros-aldebaran-romeo_moveit_actions
stepback_and_steerturn_recovery github-CIR-KIT-steer_drive_ros
rqt_stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D
stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D
surface_perception github-jstnhuang-surface_perception
rviz_textured_quads github-zlt1991-tensor_field_nav
tf_keyboard_cal github-davetcoleman-tf_keyboard_cal
thingmagic_rfid github-bsb808-thingmagic_rfid
transform_graph github-jstnhuang-transform_graph
usv_gazebo_plugins github-bsb808-usv_gazebo_plugins
viodom github-fjperezgrau-viodom
yumi_hw github-OrebroUniversity-yumi

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.3.3
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.3-devel
Last Updated 2014-12-23
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

Provided Modules

  1. Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.
  2. NumPy is the fundamental package for scientific computing with Python.
  3. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  4. TinyXML is a simple, small, C++ XML parser.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find Eigen by using the following:

find_package(Eigen REQUIRED)

Lookup sheet

Eigen
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL

find_package(GSL REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
ar_track_alvar github-sniekum-ar_track_alvar
bondcpp github-ros-bond_core
cob_vision_utils github-ipa320-cob_perception_common
eband_local_planner github-utexas-bwi-eband_local_planner
eigen_stl_containers github-ros-eigen_stl_containers
euslisp github-tork-a-euslisp-release
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
graft github-ros-perception-graft
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
eus_nlopt github-jsk-ros-pkg-jsk_control
eus_qp github-jsk-ros-pkg-jsk_control
jsk_ik_server github-jsk-ros-pkg-jsk_control
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
pr2_moveit_tutorials github-ros-planning-moveit_pr2
moveit_visual_tools github-davetcoleman-moveit_visual_tools
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nodelet github-ros-nodelet_core
laser_joint_projector github-PR2-pr2_calibration
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-PR2-pr2_mechanism
pr2_mechanism_model github-PR2-pr2_mechanism
robot_localization github-cra-ros-pkg-robot_localization
transmission_interface github-ros-controls-ros_control
gripper_action_controller github-ros-controls-ros_controllers
joint_trajectory_controller github-ros-controls-ros_controllers
rtmbuild github-start-jsk-rtmros_common
rviz github-ros-visualization-rviz
rviz_animated_view_controller github-ros-visualization-rviz_animated_view_controller
slam_karto github-ros-perception-slam_karto
sparse_bundle_adjustment github-ros-perception-sparse_bundle_adjustment
ecto_image_pipeline github-plasmodic-ecto_image_pipeline
ecto_ros github-plasmodic-ecto_ros
grizzly_motion github-g-grizzly
grizzly_msgs github-g-grizzly
hector_elevation_visualization github-tu-darmstadt-ros-pkg-hector_navigation
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
hector_quadrotor_model github-tu-darmstadt-ros-pkg-hector_quadrotor
object_recognition_core github-wg-perception-object_recognition_core
object_recognition_reconstruction github-wg-perception-reconstruction
object_recognition_ros github-wg-perception-object_recognition_ros
object_recognition_tod github-wg-perception-tod
collada_urdf github-ros-robot_model
kdl_parser github-ros-robot_model
urdf github-ros-robot_model
eigen_typekit github-orocos-rtt_geometry
rtt_rosclock github-orocos-rtt_ros_integration
rtt_rosparam github-orocos-rtt_ros_integration
stdr_parser github-stdr-simulator-ros-pkg-stdr_simulator
asctec_hl_gps github-ethz-asl-asctec_mav_framework
asctec_hl_interface github-ethz-asl-asctec_mav_framework
clasp github-utexas-bwi-clasp
cob_leg_detection github-ipa-rmb-cob_people_perception
cob_openni2_tracker github-ipa-rmb-cob_people_perception
cob_people_detection github-ipa-rmb-cob_people_perception
cob_people_tracking_filter github-ipa-rmb-cob_people_perception
descartes_core github-ros-industrial-consortium-descartes
descartes_moveit github-ros-industrial-consortium-descartes
descartes_planner github-ros-industrial-consortium-descartes
descartes_trajectory github-ros-industrial-consortium-descartes
ethzasl_extrinsic_calibration github-ethz-asl-ethzasl_icp_mapping
ethzasl_gridmap_2d github-ethz-asl-ethzasl_icp_mapping
interaction_cursor_3d github-aleeper-interaction_cursor_3d
interaction_cursor_demo github-aleeper-interaction_cursor_3d
moveit_core github-ros-planning-moveit_core
moveit_ros_benchmarks_gui github-ros-planning-moveit_ros
moveit_ros_manipulation github-ros-planning-moveit_ros
moveit_ros_perception github-ros-planning-moveit_ros
moveit_ros_planning github-ros-planning-moveit_ros
moveit_ros_planning_interface github-ros-planning-moveit_ros
moveit_ros_visualization github-ros-planning-moveit_ros
moveit_simple_grasps github-davetcoleman-moveit_simple_grasps
ndt_costmap github-tstoyanov-perception_oru-release
ndt_feature_reg github-tstoyanov-perception_oru-release
ndt_fuser github-tstoyanov-perception_oru-release
ndt_map github-tstoyanov-perception_oru-release
ndt_map_builder github-tstoyanov-perception_oru-release
ndt_mcl github-tstoyanov-perception_oru-release
ndt_registration github-tstoyanov-perception_oru-release
ndt_rviz_visualisation github-tstoyanov-perception_oru-release
ndt_visualisation github-tstoyanov-perception_oru-release
perception_oru github-tstoyanov-perception_oru-release
sdf_tracker github-tstoyanov-perception_oru-release
read_omni_dataset github-aamirahmad-read_omni_dataset
ros_ethercat_model github-shadow-robot-ros_ethercat
rviz_fixed_view_controller github-ros-visualization-rviz_fixed_view_controller
sr_gazebo_plugins github-shadow-robot-sr-ros-interface
sr_mechanism_controllers github-shadow-robot-sr-ros-interface
sr_mechanism_model github-shadow-robot-sr-ros-interface
camera_handler github-lagadic-vrep_ros_bridge
force_sensor_handler github-lagadic-vrep_ros_bridge
imu_handler github-lagadic-vrep_ros_bridge
manipulator_handler github-lagadic-vrep_ros_bridge
quadrotor_handler github-lagadic-vrep_ros_bridge
quadrotor_tk_handler github-lagadic-vrep_ros_bridge
rigid_body_handler github-lagadic-vrep_ros_bridge
vrep_ros_plugin github-lagadic-vrep_ros_bridge

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc...) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use \'d\' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
asr_descriptor_surface_based_recognition github-asr-ros-asr_descriptor_surface_based_recognition
asr_direct_search_manager github-asr-ros-asr_direct_search_manager
asr_fake_object_recognition github-asr-ros-asr_fake_object_recognition
asr_ftc_local_planner github-asr-ros-asr_ftc_local_planner
asr_intermediate_object_generator github-asr-ros-asr_intermediate_object_generator
asr_ism_visualizations github-asr-ros-asr_ism_visualizations
asr_kinematic_chain_optimizer github-asr-ros-asr_kinematic_chain_optimizer
asr_lib_pose_prediction_ism github-asr-ros-asr_lib_pose_prediction_ism
asr_mild_calibration_tool github-asr-ros-asr_mild_calibration_tool
asr_navfn github-asr-ros-asr_navfn
asr_next_best_view github-asr-ros-asr_next_best_view
asr_object_database github-asr-ros-asr_object_database
asr_psm github-asr-ros-asr_psm
asr_psm_visualizations github-asr-ros-asr_psm_visualizations
asr_recognizer_prediction_ism github-asr-ros-asr_recognizer_prediction_ism
asr_relation_graph_generator github-asr-ros-asr_relation_graph_generator
asr_resources_for_psm github-asr-ros-asr_resources_for_psm
asr_robot_model_services github-asr-ros-asr_robot_model_services
asr_sick_lms_400 github-asr-ros-asr_sick_lms_400
asr_visualization_server github-asr-ros-asr_visualization_server
asr_world_model github-asr-ros-asr_world_model
ati_force_torque github-KITrobotics-ati_force_torque
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
class_loader github-ros-class_loader
cob_mecanum_controller github-ipa320-cob_control
cob_model_identifier github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
collada_urdf github-ros-collada_urdf
control_toolbox github-ros-controls-control_toolbox
dynamixel_workbench_controllers github-ROBOTIS-GIT-dynamixel-workbench
dynamixel_workbench_operators github-ROBOTIS-GIT-dynamixel-workbench
eband_local_planner github-utexas-bwi-eband_local_planner
ecl_eigen github-stonier-ecl_core
eigen_stl_containers github-ros-eigen_stl_containers
exotica_core github-ipab-slmc-exotica
force_torque_sensor github-KITrobotics-force_torque_sensor
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
generic_control_toolbox github-diogoalmeida-generic_control_toolbox
tf2_eigen github-ros-geometry2
tf2_kdl github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
hebi_cpp_api github-HebiRobotics-hebi_cpp_api_ros
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
iirob_filters github-KITrobotics-iirob_filters
depth_image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
libmodbus github-KITrobotics-ipr_extern
ros_reflexxes github-KITrobotics-ipr_extern
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
eus_nlopt github-jsk-ros-pkg-jsk_control
eus_qp github-jsk-ros-pkg-jsk_control
jsk_ik_server github-jsk-ros-pkg-jsk_control
euscollada github-jsk-ros-pkg-jsk_model_tools
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kdl_parser github-ros-kdl_parser
swri_geometry_util github-swri-robotics-marti_common
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
test_mavros github-mavlink-mavros
ros_core github-ros-metapackages
microstrain_mips github-ros-drivers-microstrain_mips
moveit_ros_planning github-ros-planning-moveit
pr2_moveit_plugins github-ros-planning-moveit_pr2
moveit_visual_tools github-ros-planning-moveit_visual_tools
mrpt_ekf_slam_3d github-mrpt-ros-pkg-mrpt_slam
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nodelet github-ros-nodelet_core
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
ntpd_driver github-vooon-ntpd_driver
open_manipulator_control_gui github-ROBOTIS-GIT-open_manipulator
open_manipulator_controller github-ROBOTIS-GIT-open_manipulator
open_manipulator_libs github-ROBOTIS-GIT-open_manipulator
open_manipulator_p_control_gui github-ROBOTIS-GIT-open_manipulator_p
open_manipulator_p_controller github-ROBOTIS-GIT-open_manipulator_p
open_manipulator_p_libs github-ROBOTIS-GIT-open_manipulator_p
parameter_pa github-tuc-proaut-ros_parameter
pcl_ros github-ros-perception-perception_pcl
pilz_trajectory_generation github-PilzDE-pilz_industrial_motion
pilz_control github-PilzDE-pilz_robots
pilz_utils github-PilzDE-pilz_robots
prbt_hardware_support github-PilzDE-pilz_robots
prbt_support github-PilzDE-pilz_robots
pluginlib github-ros-pluginlib
laser_joint_projector github-UNR-RoboticsResearchLab-pr2_calibration
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-pr2-pr2_mechanism
pr2_mechanism_model github-pr2-pr2_mechanism
qt_gui_cpp github-ros-visualization-qt_gui_core
robot_localization github-cra-ros-pkg-robot_localization
robot_self_filter github-pr2-robot_self_filter
rsm_rqt_plugins github-MarcoStb1993-robot_statemachine
rsm_rviz_plugins github-MarcoStb1993-robot_statemachine
robotis_manipulator github-ROBOTIS-GIT-robotis_manipulator
roswtf github-ros-ros_comm
transmission_interface github-ros-controls-ros_control
ros_control_boilerplate github-davetcoleman-ros_control_boilerplate
gripper_action_controller github-ros-controls-ros_controllers
joint_trajectory_controller github-ros-controls-ros_controllers
rosmon_core github-xqms-rosmon
rospack github-ros-rospack
rosparam_shortcuts github-davetcoleman-rosparam_shortcuts
rtmbuild github-start-jsk-rtmros_common
rviz github-ros-visualization-rviz
simple_grasping github-mikeferguson-simple_grasping
slam_karto github-ros-perception-slam_karto
sparse_bundle_adjustment github-ros-perception-sparse_bundle_adjustment
sr_gazebo_sim github-shadow-robot-sr_core
sr_mechanism_controllers github-shadow-robot-sr_core
sr_mechanism_model github-shadow-robot-sr_core
srdfdom github-ros-planning-srdfdom
teb_local_planner github-rst-tu-dortmund-teb_local_planner
trac_ik_lib bitbucket-traclabs-trac_ik
turtlebot3_panorama github-ROBOTIS-GIT-turtlebot3_applications
tuw_ellipses github-tuw-robotics-tuw_marker_detection
urdf github-ros-urdf
velo2cam_calibration github-beltransen-velo2cam_calibration
apriltag_ros github-dmalyuta-apriltags2_ros
choreo_descartes_planner github-yijiangh-Choreo
depth_sensor_pose github-mdrwiega-depth_nav_tools
ecto_image_pipeline github-plasmodic-ecto_image_pipeline
ecto_ros github-plasmodic-ecto_ros
ensenso github-crigroup-ensenso
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
gravity_compensation github-kth-ros-pkg-force_torque_tools
geonav_transform github-bsb808-geonav_transform
handle_detector github-atenpas-handle_detector
hector_elevation_visualization github-tu-darmstadt-ros-pkg-hector_navigation
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
hector_quadrotor_model github-tu-darmstadt-ros-pkg-hector_quadrotor
homer_robbie_architecture gitlab-uni-koblenz-robbie-homer_robbie_architecture
humanoid_localization github-ROBOTIS-GIT-humanoid_navigation
iiwa_hw github-ipa-rwu-iiwa_stack
iiwa_ros github-ipa-rwu-iiwa_stack
jog_arm github-UTNuclearRoboticsPublic-jog_arm
kuka_eki_hw_interface github-ros-industrial-kuka_experimental
kuka_rsi_hw_interface github-ros-industrial-kuka_experimental
manipulator_h_base_module github-ROBOTIS-GIT-ROBOTIS-MANIPULATOR-H
manipulator_h_gui github-ROBOTIS-GIT-ROBOTIS-MANIPULATOR-H
manipulator_h_kinematics_dynamics github-ROBOTIS-GIT-ROBOTIS-MANIPULATOR-H
mas_cartesian_control github-b-it-bots-mas_cartesian_control
object_recognition_core github-wg-perception-object_recognition_core
object_recognition_reconstruction github-wg-perception-reconstruction
object_recognition_ros github-wg-perception-object_recognition_ros
object_recognition_tod github-wg-perception-tod
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
lgsm github-tu-rbo-omip
omip_common github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
pcl_conversions github-ros-perception-pcl_conversions
rh_p12_rn_base_module github-ROBOTIS-GIT-RH-P12-RN
rh_p12_rn_manager github-ROBOTIS-GIT-RH-P12-RN
robotis_controller github-ROBOTIS-GIT-ROBOTIS-Framework
cm_740_module github-ROBOTIS-GIT-ROBOTIS-OP3
op3_balance_control github-ROBOTIS-GIT-ROBOTIS-OP3
op3_base_module github-ROBOTIS-GIT-ROBOTIS-OP3
op3_direct_control_module github-ROBOTIS-GIT-ROBOTIS-OP3
op3_head_control_module github-ROBOTIS-GIT-ROBOTIS-OP3
op3_kinematics_dynamics github-ROBOTIS-GIT-ROBOTIS-OP3
op3_localization github-ROBOTIS-GIT-ROBOTIS-OP3
op3_manager github-ROBOTIS-GIT-ROBOTIS-OP3
op3_online_walking_module github-ROBOTIS-GIT-ROBOTIS-OP3
op3_walking_module github-ROBOTIS-GIT-ROBOTIS-OP3
open_cr_module github-ROBOTIS-GIT-ROBOTIS-OP3
op3_demo github-ROBOTIS-GIT-ROBOTIS-OP3-Demo
op3_gui_demo github-ROBOTIS-GIT-ROBOTIS-OP3-Tools
eigen_typekit github-orocos-rtt_geometry
rtt_rosclock github-orocos-rtt_ros_integration
sophus_ros_conversions github-stonier-sophus_ros_toolkit
stdr_parser github-stdr-simulator-ros-pkg-stdr_simulator
stomp_moveit github-ros-industrial-stomp_ros
stomp_plugins github-ros-industrial-stomp_ros
svenzva_drivers github-SvenzvaRobotics-svenzva_ros
tango_ros_native github-Intermodalics-tango_ros
ati_ft_sensor github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_balance_control github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_base_module github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_feet_ft_module github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_gripper_module github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_head_control_module github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_kinematics_dynamics github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_manipulation_module github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_walking_module github-ROBOTIS-GIT-ROBOTIS-THORMANG-MPC
thormang3_demo github-ROBOTIS-GIT-ROBOTIS-THORMANG-OPC
thormang3_foot_step_generator github-ROBOTIS-GIT-ROBOTIS-THORMANG-OPC
turtlebot_actions github-turtlebot-turtlebot_apps
turtlebot_arm_kinect_calibration github-turtlebot-turtlebot_arm
wire_core github-tue-robotics-wire
xiaoqiang_depth_image_proc github-bluewhalerobot-xiaoqiang
addwa_local_planner github-bluewhalerobot-xiaoqiang

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc...) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package'ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use \'d\' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

Deps Name
1 catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Repo Deps
apriltag_ros github-AprilRobotics-apriltag_ros
ar_track_alvar github-ros-perception-ar_track_alvar
asr_descriptor_surface_based_recognition github-asr-ros-asr_descriptor_surface_based_recognition
asr_direct_search_manager github-asr-ros-asr_direct_search_manager
asr_fake_object_recognition github-asr-ros-asr_fake_object_recognition
asr_ftc_local_planner github-asr-ros-asr_ftc_local_planner
asr_intermediate_object_generator github-asr-ros-asr_intermediate_object_generator
asr_ism_visualizations github-asr-ros-asr_ism_visualizations
asr_kinematic_chain_optimizer github-asr-ros-asr_kinematic_chain_optimizer
asr_lib_pose_prediction_ism github-asr-ros-asr_lib_pose_prediction_ism
asr_mild_calibration_tool github-asr-ros-asr_mild_calibration_tool
asr_navfn github-asr-ros-asr_navfn
asr_next_best_view github-asr-ros-asr_next_best_view
asr_object_database github-asr-ros-asr_object_database
asr_psm github-asr-ros-asr_psm
asr_psm_visualizations github-asr-ros-asr_psm_visualizations
asr_recognizer_prediction_ism github-asr-ros-asr_recognizer_prediction_ism
asr_relation_graph_generator github-asr-ros-asr_relation_graph_generator
asr_resources_for_psm github-asr-ros-asr_resources_for_psm
asr_robot_model_services github-asr-ros-asr_robot_model_services
asr_sick_lms_400 github-asr-ros-asr_sick_lms_400
asr_visualization_server github-asr-ros-asr_visualization_server
asr_world_model github-asr-ros-asr_world_model
ground_dds_ros_bridge github-nasa-astrobee
mapper github-nasa-astrobee
ati_force_torque github-KITrobotics-ati_force_torque
bondcpp github-ros-bond_core
test_bond github-ros-bond_core
class_loader github-ros-class_loader
cob_mecanum_controller github-ipa320-cob_control
cob_model_identifier github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
collada_urdf github-ros-collada_urdf
control_toolbox github-ros-controls-control_toolbox
datmo github-kostaskonkk-datmo
dynamixel_workbench_controllers github-ROBOTIS-GIT-dynamixel-workbench
dynamixel_workbench_operators github-ROBOTIS-GIT-dynamixel-workbench
eband_local_planner github-utexas-bwi-eband_local_planner
ecl_eigen github-stonier-ecl_core
eigen_stl_containers github-ros-eigen_stl_containers
exotica_core github-ipab-slmc-exotica
force_torque_sensor github-KITrobotics-force_torque_sensor
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
generic_control_toolbox github-diogoalmeida-generic_control_toolbox
tf2_eigen github-ros-geometry2
tf2_eigen github-jsk-ros-pkg-geometry2_python3
tf2_kdl github-ros-geometry2
tf2_kdl github-jsk-ros-pkg-geometry2_python3
tf2_sensor_msgs github-ros-geometry2
tf2_sensor_msgs github-jsk-ros-pkg-geometry2_python3
graft github-ros-perception-graft
hebi_cpp_api github-HebiRobotics-hebi_cpp_api_ros
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
iirob_filters github-KITrobotics-iirob_filters
depth_image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
libmodbus github-KITrobotics-ipr_extern
ros_reflexxes github-KITrobotics-ipr_extern
mini_maxwell github-jsk-ros-pkg-jsk_3rdparty
nlopt github-jsk-ros-pkg-jsk_3rdparty
slic github-jsk-ros-pkg-jsk_3rdparty
collada_urdf_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
laser_filters_jsk_patch github-jsk-ros-pkg-jsk_3rdparty
jsk_tilt_laser github-jsk-ros-pkg-jsk_common
eus_nlopt github-jsk-ros-pkg-jsk_control
eus_qp github-jsk-ros-pkg-jsk_control
jsk_ik_server github-jsk-ros-pkg-jsk_control
euscollada github-jsk-ros-pkg-jsk_model_tools
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kdl_parser github-ros-kdl_parser
swri_geometry_util github-swri-robotics-marti_common
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
test_mavros github-mavlink-mavros
ros_core github-ros-metapackages
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
microstrain_mips github-ros-drivers-microstrain_mips
move_base_swp github-ihadzic-move_base_swp
pilz_industrial_motion_planner github-ros-planning-moveit
pr2_moveit_plugins github-ros-planning-moveit_pr2
moveit_visual_tools github-ros-planning-moveit_visual_tools
mrpt_ekf_slam_3d github-mrpt-ros-pkg-mrpt_slam
base_local_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
neo_local_planner github-neobotix-neo_local_planner
nodelet github-ros-nodelet_core
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
ntpd_driver github-vooon-ntpd_driver
open_manipulator_control_gui github-ROBOTIS-GIT-open_manipulator
open_manipulator_controller github-ROBOTIS-GIT-open_manipulator
open_manipulator_libs github-ROBOTIS-GIT-open_manipulator
open_manipulator_p_control_gui github-ROBOTIS-GIT-open_manipulator_p
open_manipulator_p_controller github-ROBOTIS-GIT-open_manipulator_p
open_manipulator_p_libs github-ROBOTIS-GIT-open_manipulator_p
ov_core github-rpng-open_vins
ov_eval github-rpng-open_vins
ov_init github-rpng-open_vins
ov_msckf github-rpng-open_vins
parameter_pa github-tuc-proaut-ros_parameter
pilz_utils github-PilzDE-pilz_common
pilz_trajectory_generation github-PilzDE-pilz_industrial_motion
pilz_control github-PilzDE-pilz_robots
prbt_hardware_support github-PilzDE-pilz_robots
prbt_support github-PilzDE-pilz_robots
pluginlib github-ros-pluginlib
laser_joint_projector github-UNR-RoboticsResearchLab-pr2_calibration
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_controller_manager github-pr2-pr2_mechanism
pr2_mechanism_model github-pr2-pr2_mechanism
psen_scan_v2 github-PilzDE-psen_scan_v2
qt_gui_cpp github-ros-visualization-qt_gui_core
robot_localization github-cra-ros-pkg-robot_localization
robot_self_filter github-PR2-robot_self_filter
rsm_rqt_plugins github-MarcoStb1993-robot_statemachine
rsm_rviz_plugins github-MarcoStb1993-robot_statemachine
robotis_manipulator github-ROBOTIS-GIT-robotis_manipulator
roswtf github-ros-ros_comm
transmission_interface github-ros-controls-ros_control
ros_control_boilerplate github-PickNikRobotics-ros_control_boilerplate
gripper_action_controller github-ros-controls-ros_controllers
joint_trajectory_controller github-ros-controls-ros_controllers
rosmon_core github-xqms-rosmon
rospack github-ros-rospack
rosparam_shortcuts github-PickNikRobotics-rosparam_shortcuts
rotors_comm github-ethz-asl-rotors_simulator
rotors_control github-ethz-asl-rotors_simulator
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rtmbuild github-start-jsk-rtmros_common
rviz github-ros-visualization-rviz
rviz_animated_view_controller github-ros-visualization-rviz_animated_view_controller
simple_grasping github-mikeferguson-simple_grasping
slam_toolbox github-SteveMacenski-slam_toolbox
sr_gazebo_sim github-shadow-robot-sr_core
sr_mechanism_controllers github-shadow-robot-sr_core
sr_mechanism_model github-shadow-robot-sr_core
sr_robot_lib github-shadow-robot-sr-ros-interface-ethercat
srdfdom github-ros-planning-srdfdom
steering_functions github-hbanzhaf-steering_functions
teb_local_planner github-rst-tu-dortmund-teb_local_planner
trac_ik_lib bitbucket-traclabs-trac_ik
turtlebot3_panorama github-ROBOTIS-GIT-turtlebot3_applications
tuw_ellipses github-tuw-robotics-tuw_marker_detection
urdf github-ros-urdf
velo2cam_calibration github-beltransen-velo2cam_calibration

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange